21 TNeighborAgentMapProps::TNeighborAgentMapProps(
22 mrpt::system::COutputLogger* logger_in,
24 : m_logger(logger_in),
28 has_init_class(false),
33 m_logger->logFmt(LVL_WARN,
"In TNeighborAgentMapProps constructor");
36 "/" +
agent.topic_namespace.data +
"/" +
"feedback" +
"/" +
"gridmap";
38 "feedback" +
"/" +
"robot_trajectory";
40 cout <<
"Map topic: " << this->
map_topic << endl;
70 m_logger->logFmt(LVL_WARN,
"In TNeighborAgentMapProps::setupComm");
77 m_logger->logFmt(LVL_WARN,
"In TNeighborAgentMapProps::setupSubs");
88 const nav_msgs::OccupancyGrid::ConstPtr& nav_gridmap)
94 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.
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.
mrpt::system::COutputLogger * m_logger
std::string map_topic
Map topic to subscribe and fetch the map from.