Only released in EOL distros:
Corobot: PhidgetMotor | PhidgetServo | corobot_arm | corobot_camera | corobot_gps | corobot_hokuyo | corobot_joystick | corobot_map_to_jpeg | corobot_msgs | corobot_pantilt | corobot_phidgetIK | corobot_srvs | corobot_ssc32 | corobot_state_tf | corobot_teleop
Package Summary
Documented
Package based on the package hector_compressed_map_transport. It provides means for transporting compressed map data through the use of image_transport. The difference with hector_compressed_map_transport is that the position and orientation of the robot is displayed on the map.
- Author: Morgan Cormier
- License: BSD
- Source: svn http://svn.code.sf.net/p/roscorobot/code/trunk/Electric/Corobot
Contents
ROS API
map_to_image_node
map_to_image_node is a package that permit to convert a map from type OccupancyGrid to an image.Subscribed Topics
pose (geometry_msgs/PoseStamped)- position of the robot
- map generated by a SLAM algorithm
Published Topics
map_image/full_with_position (sensor_msgs/Image)- Full map showing the position of the robot
- Full map without the position of the robot
- Map of the local environment
image_to_map_node
image_to_map_node is a package that permit to convert an image representing a map to the type OccupancyGrid.Subscribed Topics
map_image_raw (sensor_msgs/Image)- Map of the environment
Published Topics
/map_from_jpeg (nav_msgs/OccupancyGrid)- Map of the environment
Parameters
resolution (double, default: 0.05)- The map resolution in meters. This is the length of a grid cell edge.