Show EOL distros:
Package Summary
The mrpt_map is able to publish a mrpt map as ros occupancy grid like the map_server
- Maintainer: Markus Bader <markus.bader AT tuwien.ac DOT at>
- Author:
- License: BSD
- Source: git https://github.com/mrpt-ros-pkg/mrpt_common.git (branch: master)
Package Summary
The mrpt_map is able to publish a mrpt map as ros occupancy grid like the map_server
- Maintainer: Markus Bader <markus.bader AT tuwien.ac DOT at>
- Author:
- License: BSD
- Source: git https://github.com/mrpt-ros-pkg/mrpt_navigation.git (branch: indigo-devel)
Package Summary
The mrpt_map is able to publish a mrpt map as ros occupancy grid like the map_server
- Maintainer status: maintained
- Maintainer: Markus Bader <markus.bader AT tuwien.ac DOT at>
- Author:
- License: BSD
- Source: git https://github.com/mrpt-ros-pkg/mrpt_navigation.git (branch: master)
Package Summary
The mrpt_map is able to publish a mrpt map as ros occupancy grid like the map_server
- Maintainer status: maintained
- Maintainer: Markus Bader <markus.bader AT tuwien.ac DOT at>
- Author:
- License: BSD
- Source: git https://github.com/mrpt-ros-pkg/mrpt_navigation.git (branch: master)
Package Summary
The mrpt_map is able to publish a mrpt map as ros occupancy grid like the map_server
- Maintainer status: maintained
- Maintainer: Markus Bader <markus.bader AT tuwien.ac DOT at>
- Author:
- License: BSD
- Source: git https://github.com/mrpt-ros-pkg/mrpt_navigation.git (branch: master)
Package Summary
The mrpt_map is able to publish a mrpt map as ros occupancy grid like the map_server
- Maintainer status: maintained
- Maintainer: Markus Bader <markus.bader AT tuwien.ac DOT at>
- Author:
- License: BSD
- Source: git https://github.com/mrpt-ros-pkg/mrpt_navigation.git (branch: master)
Package Summary
The mrpt_map is able to publish a mrpt map as ros occupancy grid like the map_server
- Maintainer status: maintained
- Maintainer: Markus Bader <markus.bader AT tuwien.ac DOT at>, Jose Luis Blanco-Claraco <joseluisblancoc AT gmail DOT com>
- Author:
- License: BSD
- Source: git https://github.com/mrpt-ros-pkg/mrpt_navigation.git (branch: ros1)
Package Summary
The mrpt_map is able to publish a mrpt map as ros occupancy grid like the map_server
- Maintainer status: developed
- Maintainer: Markus Bader <markus.bader AT tuwien.ac DOT at>, Jose Luis Blanco-Claraco <joseluisblancoc AT gmail DOT com>
- Author:
- License: BSD
- Source: git https://github.com/mrpt-ros-pkg/mrpt_navigation.git (branch: ros1)
Contents
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)
- 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")- Path to a configuration file containing all the required MRPT map parameters. See TSetOfMetricMapInitializers::loadFromConfigFile for format specifications.
- 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.
- Verbose debug output
- Map publication rate (Hz)
- TF frame name for published map messages