2 #include <nav_msgs/GetMap.h>     3 #include <std_srvs/Trigger.h>     7 #include <nav2d_navigator/MoveToPosition2DAction.h>     8 #include <nav2d_navigator/ExploreAction.h>     9 #include <nav2d_navigator/GetFirstMapAction.h>    10 #include <nav2d_navigator/LocalizeAction.h>    31         bool receiveStop(std_srvs::Trigger::Request &req, std_srvs::Trigger::Response &res);
    32         bool receivePause(std_srvs::Trigger::Request &req, std_srvs::Trigger::Response &res);
    33         void receiveMoveGoal(
const nav2d_navigator::MoveToPosition2DGoal::ConstPtr &goal);
 MapInflationTool mInflationTool
bool receiveStop(std_srvs::Trigger::Request &req, std_srvs::Trigger::Response &res)
double mNavigationGoalDistance
unsigned int mCellInflationRadius
void receiveExploreGoal(const nav2d_navigator::ExploreGoal::ConstPtr &goal)
ros::ServiceServer mPauseServer
std::string mExplorationStrategy
ros::ServiceClient mGetMapClient
ros::Publisher mMarkerPublisher
signed char mCostObstacle
MoveActionServer * mMoveActionServer
double mNavigationGoalAngle
LocalizeActionServer * mLocalizeActionServer
double mMaxReplanningPeriod
pluginlib::ClassLoader< ExplorationPlanner > PlanLoader
tf::TransformListener mTfListener
bool setCurrentPosition()
double mMinReplanningPeriod
ros::ServiceServer mStopServer
actionlib::SimpleActionServer< nav2d_navigator::ExploreAction > ExploreActionServer
void receiveGetMapGoal(const nav2d_navigator::GetFirstMapGoal::ConstPtr &goal)
std::string mMoveActionTopic
ExploreActionServer * mExploreActionServer
double mNavigationHomingDistance
void receiveLocalizeGoal(const nav2d_navigator::LocalizeGoal::ConstPtr &goal)
ros::Publisher mCommandPublisher
std::string mExploreActionTopic
void receiveMoveGoal(const nav2d_navigator::MoveToPosition2DGoal::ConstPtr &goal)
actionlib::SimpleActionServer< nav2d_navigator::GetFirstMapAction > GetMapActionServer
std::string mLocalizeActionTopic
boost::shared_ptr< ExplorationPlanner > mExplorationPlanner
std::string mGetMapActionTopic
bool receivePause(std_srvs::Trigger::Request &req, std_srvs::Trigger::Response &res)
actionlib::SimpleActionServer< nav2d_navigator::LocalizeAction > LocalizeActionServer
ros::Subscriber mGoalSubscriber
ros::Publisher mPlanPublisher
double mExplorationGoalDistance
actionlib::SimpleActionServer< nav2d_navigator::MoveToPosition2DAction > MoveActionServer
GetMapActionServer * mGetMapActionServer
unsigned int mCellRobotRadius