Go to the documentation of this file.
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);
actionlib::SimpleActionServer< nav2d_navigator::GetFirstMapAction > GetMapActionServer
double mCommandTargetDistance
unsigned int mCellInflationRadius
MapInflationTool mInflationTool
actionlib::SimpleActionServer< nav2d_navigator::MoveToPosition2DAction > MoveActionServer
bool receiveStop(std_srvs::Trigger::Request &req, std_srvs::Trigger::Response &res)
std::string mExplorationStrategy
actionlib::SimpleActionServer< nav2d_navigator::ExploreAction > ExploreActionServer
MoveActionServer * mMoveActionServer
ros::ServiceClient mGetMapClient
double mMaxReplanningPeriod
ros::ServiceServer mStopServer
ros::ServiceServer mPauseServer
signed char mCostObstacle
double mNavigationGoalDistance
ExploreActionServer * mExploreActionServer
bool setCurrentPosition()
double mMinReplanningPeriod
std::string mMoveActionTopic
ros::Publisher mMarkerPublisher
double mNavigationHomingDistance
std::string mLocalizeActionTopic
tf::TransformListener mTfListener
LocalizeActionServer * mLocalizeActionServer
actionlib::SimpleActionServer< nav2d_navigator::LocalizeAction > LocalizeActionServer
double mNavigationGoalAngle
std::string mExploreActionTopic
void receiveLocalizeGoal(const nav2d_navigator::LocalizeGoal::ConstPtr &goal)
void receiveMoveGoal(const nav2d_navigator::MoveToPosition2DGoal::ConstPtr &goal)
bool receivePause(std_srvs::Trigger::Request &req, std_srvs::Trigger::Response &res)
unsigned int mCellRobotRadius
ros::Subscriber mGoalSubscriber
std::string mGetMapActionTopic
ros::Publisher mPlanPublisher
double mExplorationGoalDistance
void receiveGetMapGoal(const nav2d_navigator::GetFirstMapGoal::ConstPtr &goal)
ros::Publisher mCommandPublisher
pluginlib::ClassLoader< ExplorationPlanner > PlanLoader
boost::shared_ptr< ExplorationPlanner > mExplorationPlanner
GetMapActionServer * mGetMapActionServer
void receiveExploreGoal(const nav2d_navigator::ExploreGoal::ConstPtr &goal)
nav2d_navigator
Author(s): Sebastian Kasperski
autogenerated on Wed Mar 2 2022 00:37:37