<> <> == ROS API == <> {{{ #!clearsilver CS/NodeAPI node.0 { name=map_to_image_node desc=`map_to_image_node` is a package that permit to convert a map from type OccupancyGrid to an image. sub{ 0.name= pose 0.type= geometry_msgs/PoseStamped 0.desc= position of the robot 1.name= map 1.type= nav_msgs/OccupancyGrid 1.desc= map generated by a SLAM algorithm } pub{ 0.name= map_image/full_with_position 0.type= sensor_msgs/Image 0.desc= Full map showing the position of the robot 1.name= map_image/full 1.type= sensor_msgs/Image 1.desc= Full map without the position of the robot 2.name= map_image/tile 2.type= sensor_msgs/Image 2.desc= Map of the local environment } } node.1 { name=image_to_map_node desc=`image_to_map_node` is a package that permit to convert an image representing a map to the type OccupancyGrid. sub{ 0.name= map_image_raw 0.type= sensor_msgs/Image 0.desc= Map of the environment } pub{ 0.name= /map_from_jpeg 0.type= nav_msgs/OccupancyGrid 0.desc= Map of the environment } param{ 0.name= resolution 0.type= double 0.desc= The map resolution in meters. This is the length of a grid cell edge. 0.default= 0.05 } } }}} ## AUTOGENERATED DON'T DELETE ## CategoryPackage