#include <ros/ros.h>
#include <nav_msgs/OccupancyGrid.h>
#include <nav_msgs/Path.h>
#include <mrpt_bridge/map.h>
#include <mrpt_msgs/GraphSlamAgents.h>
#include <mrpt/utils/COutputLogger.h>
#include <mrpt/maps/COccupancyGridMap2D.h>
#include <mrpt/math/utils.h>
Go to the source code of this file.
Classes | |
struct | mrpt::graphslam::TNeighborAgentMapProps |
Struct holding a COccupancyGridMap2D (as well as subscribers for updating it) for a specific running GraphSlamAgent instance. More... | |
Namespaces | |
mrpt | |
mrpt::graphslam | |