12 #include <mrpt/version.h> 13 #if MRPT_VERSION>=0x199 27 TNeighborAgentMapProps::TNeighborAgentMapProps(
28 mrpt::utils::COutputLogger* logger_in,
29 const mrpt_msgs::GraphSlamAgent& agent_in,
35 has_init_class(false),
40 m_logger->logFmt(LVL_WARN,
"In TNeighborAgentMapProps constructor");
43 "feedback" +
"/" +
"gridmap";
45 "feedback" +
"/" +
"robot_trajectory";
47 cout <<
"Map topic: " << this->
map_topic << endl;
76 m_logger->logFmt(LVL_WARN,
"In TNeighborAgentMapProps::setupComm");
82 m_logger->logFmt(LVL_WARN,
"In TNeighborAgentMapProps::setupSubs");
95 const nav_msgs::OccupancyGrid::ConstPtr& nav_gridmap) {
100 const nav_msgs::Path::ConstPtr& nav_robot_traj) {
std::string robot_trajectory_topic
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.
Subscriber subscribe(const std::string &topic, uint32_t queue_size, void(T::*fp)(M), T *obj, const TransportHints &transport_hints=TransportHints())
void updateGridMap(const nav_msgs::OccupancyGrid::ConstPtr &nav_gridmap)
Callback method to be called when new data in the map topic is available.
mrpt::utils::COutputLogger * m_logger
nav_msgs::Path::ConstPtr nav_robot_trajectory
Trajectory of the correspondign agent - in ROS form.
ros::Subscriber robot_trajectory_sub
const mrpt_msgs::GraphSlamAgent & agent
Pointer to the GraphSlamAgent instance of the neighbor.
ros::Subscriber map_sub
Map subscriber instance.
nav_msgs::OccupancyGrid::ConstPtr nav_map
Map generated by the corresponding agent - in ROS form.
std::string map_topic
Map topic to subscribe and fetch the map from.