1 #ifndef EXPLORATION_PLANNER_H 2 #define EXPLORATION_PLANNER_H 4 #define EXPL_TARGET_SET 1 5 #define EXPL_FINISHED 2 11 #include <nav2d_msgs/RobotPose.h> 16 typedef std::map<unsigned int, geometry_msgs::Pose2D>
PoseList;
44 virtual int findExplorationTarget(
GridMap* map,
unsigned int start,
unsigned int &goal) = 0;
Subscriber subscribe(const std::string &topic, uint32_t queue_size, void(T::*fp)(M), T *obj, const TransportHints &transport_hints=TransportHints())
void receiveOtherPose(const nav2d_msgs::RobotPose::ConstPtr &msg)
ros::Subscriber mOtherRobotsSubscriber
std::map< unsigned int, geometry_msgs::Pose2D > PoseList
virtual ~ExplorationPlanner()