The AbstractNavigationServer is the abstract base class for all navigation servers in move_base_flex and bundles the controller execution classes,the planner execution classes and the recovery execution classes. It provides the following action servers ActionServerGetPath -> callActionGetPath(), ActionServerExePath -> callActionExePath(), ActionServerRecovery -> callActionRecovery() and ActionServerMoveBase -> callActionMoveBase(). More...
#include <abstract_navigation_server.h>
| Public Member Functions | |
| AbstractNavigationServer (const TFPtr &tf_listener_ptr) | |
| Constructor, reads all parameters and initializes all action servers and creates the plugin instances. Parameters are the concrete implementations of the abstract classes.  More... | |
| virtual void | callActionExePath (ActionServerExePath::GoalHandle goal_handle) | 
| ExePath action execution method. This method will be called if the action server receives a goal.  More... | |
| virtual void | callActionGetPath (ActionServerGetPath::GoalHandle goal_handle) | 
| GetPath action execution method. This method will be called if the action server receives a goal.  More... | |
| virtual void | callActionMoveBase (ActionServerMoveBase::GoalHandle goal_handle) | 
| MoveBase action execution method. This method will be called if the action server receives a goal.  More... | |
| virtual void | callActionRecovery (ActionServerRecovery::GoalHandle goal_handle) | 
| Recovery action execution method. This method will be called if the action server receives a goal.  More... | |
| virtual void | cancelActionExePath (ActionServerExePath::GoalHandle goal_handle) | 
| virtual void | cancelActionGetPath (ActionServerGetPath::GoalHandle goal_handle) | 
| virtual void | cancelActionMoveBase (ActionServerMoveBase::GoalHandle goal_handle) | 
| virtual void | cancelActionRecovery (ActionServerRecovery::GoalHandle goal_handle) | 
| virtual bool | initializeControllerPlugin (const std::string &name, const mbf_abstract_core::AbstractController::Ptr &controller_ptr)=0 | 
| Pure virtual method, the derived class has to implement. Depending on the plugin base class, some plugins need to be initialized!  More... | |
| virtual bool | initializePlannerPlugin (const std::string &name, const mbf_abstract_core::AbstractPlanner::Ptr &planner_ptr)=0 | 
| Pure virtual method, the derived class has to implement. Depending on the plugin base class, some plugins need to be initialized!  More... | |
| virtual bool | initializeRecoveryPlugin (const std::string &name, const mbf_abstract_core::AbstractRecovery::Ptr &behavior_ptr)=0 | 
| Pure virtual method, the derived class has to implement. Depending on the plugin base class, some plugins need to be initialized!  More... | |
| virtual void | initializeServerComponents () | 
| initializes all server components. Initializing the plugins of the Planner, the Controller, and the Recovery Behavior.  More... | |
| virtual mbf_abstract_core::AbstractController::Ptr | loadControllerPlugin (const std::string &controller_type)=0 | 
| Loads the plugin associated with the given controller type parameter.  More... | |
| virtual mbf_abstract_core::AbstractPlanner::Ptr | loadPlannerPlugin (const std::string &planner_type)=0 | 
| Loads the plugin associated with the given planner_type parameter.  More... | |
| virtual mbf_abstract_core::AbstractRecovery::Ptr | loadRecoveryPlugin (const std::string &recovery_type)=0 | 
| Loads a Recovery plugin associated with given recovery type parameter.  More... | |
| virtual mbf_abstract_nav::AbstractControllerExecution::Ptr | newControllerExecution (const std::string &plugin_name, const mbf_abstract_core::AbstractController::Ptr &plugin_ptr) | 
| Create a new abstract controller execution.  More... | |
| virtual mbf_abstract_nav::AbstractPlannerExecution::Ptr | newPlannerExecution (const std::string &plugin_name, const mbf_abstract_core::AbstractPlanner::Ptr &plugin_ptr) | 
| Create a new abstract planner execution.  More... | |
| virtual mbf_abstract_nav::AbstractRecoveryExecution::Ptr | newRecoveryExecution (const std::string &plugin_name, const mbf_abstract_core::AbstractRecovery::Ptr &plugin_ptr) | 
| Create a new abstract recovery behavior execution.  More... | |
| virtual void | startActionServers () | 
| starts all action server.  More... | |
| virtual void | stop () | 
| virtual | ~AbstractNavigationServer () | 
| Destructor.  More... | |
| Protected Member Functions | |
| virtual void | reconfigure (mbf_abstract_nav::MoveBaseFlexConfig &config, uint32_t level) | 
| Reconfiguration method called by dynamic reconfigure.  More... | |
| virtual void | startDynamicReconfigureServer () | 
| Start a dynamic reconfigure server. This must be called only if the extending doesn't create its own.  More... | |
| bool | transformPlanToGlobalFrame (std::vector< geometry_msgs::PoseStamped > &plan, std::vector< geometry_msgs::PoseStamped > &global_plan) | 
| Transforms a plan to the global frame (global_frame_) coord system.  More... | |
The AbstractNavigationServer is the abstract base class for all navigation servers in move_base_flex and bundles the controller execution classes,the planner execution classes and the recovery execution classes. It provides the following action servers ActionServerGetPath -> callActionGetPath(), ActionServerExePath -> callActionExePath(), ActionServerRecovery -> callActionRecovery() and ActionServerMoveBase -> callActionMoveBase().
Definition at line 118 of file abstract_navigation_server.h.
| mbf_abstract_nav::AbstractNavigationServer::AbstractNavigationServer | ( | const TFPtr & | tf_listener_ptr | ) | 
Constructor, reads all parameters and initializes all action servers and creates the plugin instances. Parameters are the concrete implementations of the abstract classes.
| tf_listener_ptr | shared pointer to the common TransformListener buffering transformations | 
Definition at line 48 of file abstract_navigation_server.cpp.
| 
 | virtual | 
Destructor.
Definition at line 119 of file abstract_navigation_server.cpp.
| 
 | virtual | 
ExePath action execution method. This method will be called if the action server receives a goal.
| goal | SimpleActionServer goal containing all necessary parameters for the action execution. See the action definitions in mbf_msgs. | 
Definition at line 183 of file abstract_navigation_server.cpp.
| 
 | virtual | 
GetPath action execution method. This method will be called if the action server receives a goal.
| goal | SimpleActionServer goal containing all necessary parameters for the action execution. See the action definitions in mbf_msgs. | 
Definition at line 124 of file abstract_navigation_server.cpp.
| 
 | virtual | 
MoveBase action execution method. This method will be called if the action server receives a goal.
| goal | SimpleActionServer goal containing all necessary parameters for the action execution. See the action definitions in mbf_msgs. | 
Definition at line 299 of file abstract_navigation_server.cpp.
| 
 | virtual | 
Recovery action execution method. This method will be called if the action server receives a goal.
| goal | SimpleActionServer goal containing all necessary parameters for the action execution. See the action definitions in mbf_msgs. | 
Definition at line 241 of file abstract_navigation_server.cpp.
| 
 | virtual | 
Definition at line 235 of file abstract_navigation_server.cpp.
| 
 | virtual | 
Definition at line 177 of file abstract_navigation_server.cpp.
| 
 | virtual | 
Definition at line 305 of file abstract_navigation_server.cpp.
| 
 | virtual | 
Definition at line 293 of file abstract_navigation_server.cpp.
| 
 | pure virtual | 
Pure virtual method, the derived class has to implement. Depending on the plugin base class, some plugins need to be initialized!
| name | The name of the controller | 
| controller_ptr | pointer to the controller object which corresponds to the name param | 
| 
 | pure virtual | 
Pure virtual method, the derived class has to implement. Depending on the plugin base class, some plugins need to be initialized!
| name | The name of the planner | 
| planner_ptr | pointer to the planner object which corresponds to the name param | 
| 
 | pure virtual | 
Pure virtual method, the derived class has to implement. Depending on the plugin base class, some plugins need to be initialized!
| name | The name of the recovery behavior | 
| behavior_ptr | pointer to the recovery behavior object which corresponds to the name param | 
| 
 | virtual | 
initializes all server components. Initializing the plugins of the Planner, the Controller, and the Recovery Behavior.
Definition at line 112 of file abstract_navigation_server.cpp.
| 
 | pure virtual | 
Loads the plugin associated with the given controller type parameter.
| controller_type | The type of the controller plugin | 
| 
 | pure virtual | 
Loads the plugin associated with the given planner_type parameter.
| planner_type | The type of the planner plugin to load. | 
| 
 | pure virtual | 
Loads a Recovery plugin associated with given recovery type parameter.
| recovery_name | The name of the Recovery plugin | 
| 
 | virtual | 
Create a new abstract controller execution.
| plugin_name | Name of the controller to use. | 
| plugin_ptr | Shared pointer to the plugin to use. | 
Definition at line 319 of file abstract_navigation_server.cpp.
| 
 | virtual | 
Create a new abstract planner execution.
| plugin_name | Name of the planner to use. | 
| plugin_ptr | Shared pointer to the plugin to use. | 
Definition at line 312 of file abstract_navigation_server.cpp.
| 
 | virtual | 
Create a new abstract recovery behavior execution.
| plugin_name | Name of the recovery behavior to run. | 
| plugin_ptr | Shared pointer to the plugin to use | 
Definition at line 327 of file abstract_navigation_server.cpp.
| 
 | protectedvirtual | 
Reconfiguration method called by dynamic reconfigure.
| config | Configuration parameters. See the MoveBaseFlexConfig definition. | 
| level | bit mask, which parameters are set. | 
Definition at line 350 of file abstract_navigation_server.cpp.
| 
 | virtual | 
starts all action server.
Definition at line 335 of file abstract_navigation_server.cpp.
| 
 | protectedvirtual | 
Start a dynamic reconfigure server. This must be called only if the extending doesn't create its own.
Definition at line 343 of file abstract_navigation_server.cpp.
| 
 | virtual | 
Definition at line 376 of file abstract_navigation_server.cpp.
| 
 | protected | 
Transforms a plan to the global frame (global_frame_) coord system.
| plan | Input plan to be transformed. | 
| global_plan | Output plan, which is then transformed to the global frame. | 
| 
 | protected | 
shared pointer to the ExePath action server
Definition at line 307 of file abstract_navigation_server.h.
| 
 | protected | 
shared pointer to the GetPath action server
Definition at line 310 of file abstract_navigation_server.h.
| 
 | protected | 
shared pointer to the MoveBase action server
Definition at line 313 of file abstract_navigation_server.h.
| 
 | protected | 
shared pointer to the Recovery action server
Definition at line 304 of file abstract_navigation_server.h.
| 
 | protected | 
configuration mutex for derived classes and other threads.
Definition at line 319 of file abstract_navigation_server.h.
| 
 | protected | 
Definition at line 351 of file abstract_navigation_server.h.
| 
 | protected | 
Definition at line 300 of file abstract_navigation_server.h.
| 
 | protected | 
the default parameter configuration save
Definition at line 325 of file abstract_navigation_server.h.
| 
 | protected | 
dynamic reconfigure server
Definition at line 316 of file abstract_navigation_server.h.
| 
 | protected | 
the global frame, in which the robot is moving
Definition at line 334 of file abstract_navigation_server.h.
| 
 | protected | 
current_goal publisher for all controller execution objects
Definition at line 346 of file abstract_navigation_server.h.
| 
 | protected | 
last configuration save
Definition at line 322 of file abstract_navigation_server.h.
| 
 | protected | 
Definition at line 354 of file abstract_navigation_server.h.
| 
 | protected | 
Definition at line 352 of file abstract_navigation_server.h.
| 
 | protected | 
Definition at line 299 of file abstract_navigation_server.h.
| 
 | protected | 
Private node handle.
Definition at line 297 of file abstract_navigation_server.h.
| 
 | protected | 
Definition at line 353 of file abstract_navigation_server.h.
| 
 | protected | 
Definition at line 301 of file abstract_navigation_server.h.
| 
 | protected | 
the robot frame, to get the current robot pose in the global_frame_
Definition at line 331 of file abstract_navigation_server.h.
| 
 | protected | 
current robot state
Definition at line 349 of file abstract_navigation_server.h.
| 
 | protected | 
true, if the dynamic reconfigure has been setup.
Definition at line 328 of file abstract_navigation_server.h.
| 
 | protected | 
shared pointer to the common TransformListener
Definition at line 340 of file abstract_navigation_server.h.
| 
 | protected | 
timeout after tf returns without a result
Definition at line 337 of file abstract_navigation_server.h.
| 
 | protected | 
cmd_vel publisher for all controller execution objects
Definition at line 343 of file abstract_navigation_server.h.