Mapping solution for largely static obstacles. Despite the name, it can be modified, but all modifications are considered permanent unless explicitly removed. Not for use as a rapidly changing dynamic map. See the SensorMap for that capability. More...
#include <string>#include <ros/ros.h>#include <nav_msgs/OccupancyGrid.h>#include <visualization_msgs/Marker.h>#include <tf2_geometry_msgs/tf2_geometry_msgs.h>#include <tf2_ros/buffer.h>#include <tf2_ros/transform_listener.h>#include <grid_map_core/grid_map_core.hpp>#include <grid_map_ros/GridMapRosConverter.hpp>#include <grid_map_ros/grid_map_ros.hpp>#include <grid_map_msgs/GridMap.h>

Go to the source code of this file.
Classes | |
| class | mitre_fast_layered_map::StaticMap |
| struct | mitre_fast_layered_map::StaticMapConfiguration |
Namespaces | |
| mitre_fast_layered_map | |
Mapping solution for largely static obstacles. Despite the name, it can be modified, but all modifications are considered permanent unless explicitly removed. Not for use as a rapidly changing dynamic map. See the SensorMap for that capability.
Definition in file static_map.hpp.