Show EOL distros: 

Package Summary

The mrpt_map is able to publish a mrpt map as ros occupancy grid like the map_server

Package Summary

The mrpt_map is able to publish a mrpt map as ros occupancy grid like the map_server

mrpt_navigation: mrpt_local_obstacles | mrpt_localization | mrpt_map | mrpt_rawlog | mrpt_reactivenav2d | mrpt_tutorials

Package Summary

The mrpt_map is able to publish a mrpt map as ros occupancy grid like the map_server

mrpt_navigation: mrpt_bridge | mrpt_local_obstacles | mrpt_localization | mrpt_map | mrpt_msgs | mrpt_rawlog | mrpt_reactivenav2d | mrpt_tutorials

Package Summary

The mrpt_map is able to publish a mrpt map as ros occupancy grid like the map_server

mrpt_navigation: mrpt_local_obstacles | mrpt_localization | mrpt_map | mrpt_rawlog | mrpt_reactivenav2d | mrpt_tutorials

Package Summary

The mrpt_map is able to publish a mrpt map as ros occupancy grid like the map_server

mrpt_navigation: mrpt_local_obstacles | mrpt_localization | mrpt_map | mrpt_rawlog | mrpt_reactivenav2d | mrpt_tutorials

Package Summary

The mrpt_map is able to publish a mrpt map as ros occupancy grid like the map_server

mrpt_navigation: mrpt_local_obstacles | mrpt_localization | mrpt_map | mrpt_rawlog | mrpt_reactivenav2d | mrpt_tutorials

Package Summary

The mrpt_map is able to publish a mrpt map as ros occupancy grid like the map_server

mrpt_navigation: mrpt_local_obstacles | mrpt_localization | mrpt_map | mrpt_rawlog | mrpt_reactivenav2d | mrpt_tutorials

Package Summary

The mrpt_map is able to publish a mrpt map as ros occupancy grid like the map_server

Nodes

mrpt_map

The mrpt_map node publishes (static, prebuilt) metric maps stored in MRPT formats: .simplemap or .gridmap.

Most ROS packages expect the map to be a unique occupancy grid map. This node supports those simple maps, plus all other map kinds defined in MRPT.

Published Topics

map (nav_msgs/OccupancyGrid)
  • Only if param ~map_file is NOT empty, the loaded map will be published here (Latched)
map_metadata (invalid message type for MsgLink(msg/type))
  • Only if param ~map_file is NOT empty, the loaded map will be published here (Latched)

Services

static_map (nav_msgs/GetMap)
  • You can retrieve the loaded map here

Parameters

~ini_file (string, default: "map.ini") ~map_file (string, default: (none))
  • Path to an MRPT map file in either .simplemap or .gridmap formats. "Simple maps" are sequences of observation-pose pairs, so the physical metric map(s) are actually generated at load-time.
~debug (bool, default: true)
  • Verbose debug output
~frequency (double, default: 0.1)
  • Map publication rate (Hz)
~frame_id (string, default: "map")
  • TF frame name for published map messages

Wiki: mrpt_map (last edited 2014-12-23 15:13:12 by Jose Luis Blanco)