Go to the documentation of this file.
13 #include <nav_msgs/OccupancyGrid.h>
14 #include <nav_msgs/Path.h>
15 #include <mrpt/ros1bridge/map.h>
16 #include <mrpt_msgs/GraphSlamAgents.h>
17 #include <mrpt/system/COutputLogger.h>
18 #include <mrpt/maps/COccupancyGridMap2D.h>
19 #include <mrpt/math/utils.h>
33 mrpt::system::COutputLogger* logger_in,
43 void updateGridMap(
const nav_msgs::OccupancyGrid::ConstPtr& nav_gridmap);
57 const mrpt_msgs::GraphSlamAgent&
agent;
59 nav_msgs::OccupancyGrid::ConstPtr
nav_map;
ros::Subscriber map_sub
Map subscriber instance.
mrpt::system::COutputLogger * m_logger
void updateRobotTrajectory(const nav_msgs::Path::ConstPtr &nav_robot_traj)
Callback method to be called when new data in the Estimated Trajectory topic is available.
std::string robot_trajectory_topic
size_t getNodeCount()
Return how many nodes have been registered in the fetched robot trajectory.
const mrpt_msgs::GraphSlamAgent & agent
Pointer to the GraphSlamAgent instance of the neighbor.
ros::Subscriber robot_trajectory_sub
Struct holding a COccupancyGridMap2D (as well as subscribers for updating it) for a specific running ...
std::string map_topic
Map topic to subscribe and fetch the map from.
nav_msgs::Path::ConstPtr nav_robot_trajectory
Trajectory of the correspondign agent - in ROS form.
void updateGridMap(const nav_msgs::OccupancyGrid::ConstPtr &nav_gridmap)
Callback method to be called when new data in the map topic is available.
TNeighborAgentMapProps(mrpt::system::COutputLogger *logger_in, const mrpt_msgs::GraphSlamAgent &agent_in, ros::NodeHandle *nh_in)
nav_msgs::OccupancyGrid::ConstPtr nav_map
Map generated by the corresponding agent - in ROS form.