Only released in EOL distros:
Package Summary
Package based on the package hector_compressed_map_transport and improved upon. 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. It also adds a mean to convert the jpeg representation of the map back to a map.
- Maintainer: Morgan Cormier <mcormier AT coroware DOT com>
- Author:
- License: BSD
- Source: git https://github.com/morgancormier/corobot.git (branch: master)
Package Summary
Package based on the package hector_compressed_map_transport and improved upon. 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. It also adds a mean to convert the jpeg representation of the map back to a map.
- Maintainer: Morgan Cormier <mcormier AT coroware DOT com>
- Author:
- License: BSD
- Source: git https://github.com/morgancormier/corobot.git (branch: master)
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.