pax_global_header00006660000000000000000000000064135533756640014533gustar00rootroot0000000000000052 comment=3dc18b71094a7037928a8f5470f0f7418c6ce388 navigation_msgs-1.13.1/000077500000000000000000000000001355337566400150065ustar00rootroot00000000000000navigation_msgs-1.13.1/README.md000066400000000000000000000003751355337566400162720ustar00rootroot00000000000000# Navigation Messages This repository contains messages used by the [navigation stack](https://github.com/ros-planning/navigation). It is intended for use in ROS Jade and above. Prior to Jade some of these messages existed in the navigation repository.navigation_msgs-1.13.1/map_msgs/000077500000000000000000000000001355337566400166145ustar00rootroot00000000000000navigation_msgs-1.13.1/map_msgs/CHANGELOG.rst000066400000000000000000000003151355337566400206340ustar00rootroot00000000000000^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^ Changelog for package map_msgs ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^ 1.13.0 (2015-03-16) ------------------- * initial release from new repository * Contributors: Michael Ferguson navigation_msgs-1.13.1/map_msgs/CMakeLists.txt000066400000000000000000000011671355337566400213610ustar00rootroot00000000000000cmake_minimum_required(VERSION 2.8.3) project(map_msgs) find_package(catkin REQUIRED COMPONENTS message_generation nav_msgs sensor_msgs std_msgs ) add_message_files( FILES OccupancyGridUpdate.msg PointCloud2Update.msg ProjectedMapInfo.msg ProjectedMap.msg ) add_service_files( FILES GetMapROI.srv GetPointMapROI.srv GetPointMap.srv ProjectedMapsInfo.srv SaveMap.srv SetMapProjections.srv ) generate_messages( DEPENDENCIES nav_msgs sensor_msgs std_msgs ) catkin_package( CATKIN_DEPENDS message_runtime nav_msgs sensor_msgs std_msgs ) navigation_msgs-1.13.1/map_msgs/msg/000077500000000000000000000000001355337566400174025ustar00rootroot00000000000000navigation_msgs-1.13.1/map_msgs/msg/OccupancyGridUpdate.msg000066400000000000000000000001161355337566400240050ustar00rootroot00000000000000std_msgs/Header header int32 x int32 y uint32 width uint32 height int8[] data navigation_msgs-1.13.1/map_msgs/msg/PointCloud2Update.msg000066400000000000000000000002171355337566400234170ustar00rootroot00000000000000uint32 ADD=0 uint32 DELETE=1 std_msgs/Header header uint32 type # type of update, one of ADD or DELETE sensor_msgs/PointCloud2 points navigation_msgs-1.13.1/map_msgs/msg/ProjectedMap.msg000066400000000000000000000000661355337566400224710ustar00rootroot00000000000000nav_msgs/OccupancyGrid map float64 min_z float64 max_znavigation_msgs-1.13.1/map_msgs/msg/ProjectedMapInfo.msg000066400000000000000000000001341355337566400233010ustar00rootroot00000000000000string frame_id float64 x float64 y float64 width float64 height float64 min_z float64 max_znavigation_msgs-1.13.1/map_msgs/package.xml000066400000000000000000000016651355337566400207410ustar00rootroot00000000000000 map_msgs 1.13.1 This package defines messages commonly used in mapping packages. Stéphane Magnenat David V. Lu!! Michael Ferguson BSD http://ros.org/wiki/map_msgs https://github.com/ros-planning/navigation_msgs/issues catkin message_generation nav_msgs sensor_msgs std_msgs message_runtime nav_msgs sensor_msgs std_msgs navigation_msgs-1.13.1/map_msgs/srv/000077500000000000000000000000001355337566400174265ustar00rootroot00000000000000navigation_msgs-1.13.1/map_msgs/srv/GetMapROI.srv000066400000000000000000000001161355337566400217070ustar00rootroot00000000000000float64 x float64 y float64 l_x float64 l_y --- nav_msgs/OccupancyGrid sub_mapnavigation_msgs-1.13.1/map_msgs/srv/GetPointMap.srv000066400000000000000000000001131355337566400223440ustar00rootroot00000000000000# Get the map as a sensor_msgs/PointCloud2 --- sensor_msgs/PointCloud2 map navigation_msgs-1.13.1/map_msgs/srv/GetPointMapROI.srv000066400000000000000000000003741355337566400227270ustar00rootroot00000000000000float64 x float64 y float64 z float64 r # if != 0, circular ROI of radius r float64 l_x # if r == 0, length of AABB on x float64 l_y # if r == 0, length of AABB on y float64 l_z # if r == 0, length of AABB on z --- sensor_msgs/PointCloud2 sub_mapnavigation_msgs-1.13.1/map_msgs/srv/ProjectedMapsInfo.srv000066400000000000000000000000641355337566400235360ustar00rootroot00000000000000map_msgs/ProjectedMapInfo[] projected_maps_info --- navigation_msgs-1.13.1/map_msgs/srv/SaveMap.srv000066400000000000000000000000761355337566400215210ustar00rootroot00000000000000# Save the map to the filesystem std_msgs/String filename --- navigation_msgs-1.13.1/map_msgs/srv/SetMapProjections.srv000066400000000000000000000000641355337566400235730ustar00rootroot00000000000000--- map_msgs/ProjectedMapInfo[] projected_maps_info navigation_msgs-1.13.1/move_base_msgs/000077500000000000000000000000001355337566400177775ustar00rootroot00000000000000navigation_msgs-1.13.1/move_base_msgs/CHANGELOG.rst000066400000000000000000000003371355337566400220230ustar00rootroot00000000000000^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^ Changelog for package move_base_msgs ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^ 1.13.0 (2015-03-16) ------------------- * initial release from new repository * Contributors: Michael Ferguson navigation_msgs-1.13.1/move_base_msgs/CMakeLists.txt000066400000000000000000000006141355337566400225400ustar00rootroot00000000000000cmake_minimum_required(VERSION 2.8.3) project(move_base_msgs) find_package(catkin REQUIRED COMPONENTS actionlib_msgs geometry_msgs message_generation ) add_action_files( DIRECTORY action FILES MoveBase.action ) generate_messages( DEPENDENCIES actionlib_msgs geometry_msgs ) catkin_package( CATKIN_DEPENDS actionlib_msgs geometry_msgs message_runtime ) navigation_msgs-1.13.1/move_base_msgs/action/000077500000000000000000000000001355337566400212545ustar00rootroot00000000000000navigation_msgs-1.13.1/move_base_msgs/action/MoveBase.action000066400000000000000000000001261355337566400241530ustar00rootroot00000000000000geometry_msgs/PoseStamped target_pose --- --- geometry_msgs/PoseStamped base_position navigation_msgs-1.13.1/move_base_msgs/package.xml000066400000000000000000000017321355337566400221170ustar00rootroot00000000000000 move_base_msgs 1.13.1 Holds the action description and relevant messages for the move_base package. Eitan Marder-Eppstein contradict@gmail.com David V. Lu!! Michael Ferguson BSD http://wiki.ros.org/move_base_msgs https://github.com/ros-planning/navigation_msgs/issues catkin actionlib_msgs geometry_msgs message_generation actionlib_msgs geometry_msgs message_runtime