The CostmapNavigationServer makes Move Base Flex backwards compatible to the old move_base. It combines the execution classes which use the nav_core/BaseLocalPlanner, nav_core/BaseCostmapPlanner and the nav_core/RecoveryBehavior base classes as plugin interfaces. These plugin interface are the same for the old move_base. More...
#include <costmap_navigation_server.h>
Public Types | |
typedef boost::shared_ptr< CostmapNavigationServer > | Ptr |
Private Member Functions | |
bool | callServiceCheckPathCost (mbf_msgs::CheckPath::Request &request, mbf_msgs::CheckPath::Response &response) |
Callback method for the check_path_cost service. More... | |
bool | callServiceCheckPointCost (mbf_msgs::CheckPoint::Request &request, mbf_msgs::CheckPoint::Response &response) |
Callback method for the check_point_cost service. More... | |
bool | callServiceCheckPoseCost (mbf_msgs::CheckPose::Request &request, mbf_msgs::CheckPose::Response &response) |
Callback method for the check_pose_cost service. More... | |
bool | callServiceClearCostmaps (std_srvs::Empty::Request &request, std_srvs::Empty::Response &response) |
Callback method for the make_plan service. More... | |
virtual bool | initializeControllerPlugin (const std::string &name, const mbf_abstract_core::AbstractController::Ptr &controller_ptr) |
Initializes the controller plugin with its name, a pointer to the TransformListener and pointer to the costmap. More... | |
virtual bool | initializePlannerPlugin (const std::string &name, const mbf_abstract_core::AbstractPlanner::Ptr &planner_ptr) |
Initializes the controller plugin with its name and pointer to the costmap. More... | |
virtual bool | initializeRecoveryPlugin (const std::string &name, const mbf_abstract_core::AbstractRecovery::Ptr &behavior_ptr) |
Initializes a recovery behavior plugin with its name and pointers to the global and local costmaps. More... | |
virtual mbf_abstract_core::AbstractController::Ptr | loadControllerPlugin (const std::string &controller_type) |
Loads the plugin associated with the given controller type parameter. More... | |
virtual mbf_abstract_core::AbstractPlanner::Ptr | loadPlannerPlugin (const std::string &planner_type) |
Loads the plugin associated with the given planner_type parameter. More... | |
virtual mbf_abstract_core::AbstractRecovery::Ptr | loadRecoveryPlugin (const std::string &recovery_type) |
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 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 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 recovery behavior execution. More... | |
void | reconfigure (mbf_costmap_nav::MoveBaseFlexConfig &config, uint32_t level) |
Reconfiguration method called by dynamic reconfigure. More... | |
The CostmapNavigationServer makes Move Base Flex backwards compatible to the old move_base. It combines the execution classes which use the nav_core/BaseLocalPlanner, nav_core/BaseCostmapPlanner and the nav_core/RecoveryBehavior base classes as plugin interfaces. These plugin interface are the same for the old move_base.
Definition at line 80 of file costmap_navigation_server.h.
Definition at line 84 of file costmap_navigation_server.h.
mbf_costmap_nav::CostmapNavigationServer::CostmapNavigationServer | ( | const TFPtr & | tf_listener_ptr | ) |
Constructor.
tf_listener_ptr | Shared pointer to a common TransformListener |
Definition at line 58 of file costmap_navigation_server.cpp.
|
virtual |
Destructor.
Definition at line 91 of file costmap_navigation_server.cpp.
|
private |
Callback method for the check_path_cost service.
request | Request object, see the mbf_msgs/CheckPath service definition file. |
response | Response object, see the mbf_msgs/CheckPath service definition file. |
Definition at line 566 of file costmap_navigation_server.cpp.
|
private |
Callback method for the check_point_cost service.
request | Request object, see the mbf_msgs/CheckPoint service definition file. |
response | Response object, see the mbf_msgs/CheckPoint service definition file. |
Definition at line 366 of file costmap_navigation_server.cpp.
|
private |
Callback method for the check_pose_cost service.
request | Request object, see the mbf_msgs/CheckPose service definition file. |
response | Response object, see the mbf_msgs/CheckPose service definition file. |
Definition at line 443 of file costmap_navigation_server.cpp.
|
private |
Callback method for the make_plan service.
request | Empty request object. |
response | Empty response object. |
Definition at line 709 of file costmap_navigation_server.cpp.
|
privatevirtual |
Initializes the controller plugin with its name, a pointer to the TransformListener and pointer to the costmap.
name | The name of the controller |
controller_ptr | pointer to the controller object which corresponds to the name param |
Implements mbf_abstract_nav::AbstractNavigationServer.
Definition at line 226 of file costmap_navigation_server.cpp.
|
privatevirtual |
Initializes the controller plugin with its name and pointer to the costmap.
name | The name of the planner |
planner_ptr | pointer to the planner object which corresponds to the name param |
Implements mbf_abstract_nav::AbstractNavigationServer.
Definition at line 174 of file costmap_navigation_server.cpp.
|
privatevirtual |
Initializes a recovery behavior plugin with its name and pointers to the global and local costmaps.
name | The name of the recovery behavior |
behavior_ptr | pointer to the recovery behavior object which corresponds to the name param |
Implements mbf_abstract_nav::AbstractNavigationServer.
Definition at line 288 of file costmap_navigation_server.cpp.
|
privatevirtual |
Loads the plugin associated with the given controller type parameter.
controller_type | The type of the controller plugin |
Implements mbf_abstract_nav::AbstractNavigationServer.
Definition at line 195 of file costmap_navigation_server.cpp.
|
privatevirtual |
Loads the plugin associated with the given planner_type parameter.
planner_type | The type of the planner plugin to load. |
Implements mbf_abstract_nav::AbstractNavigationServer.
Definition at line 142 of file costmap_navigation_server.cpp.
|
privatevirtual |
Loads a Recovery plugin associated with given recovery type parameter.
recovery_name | The name of the Recovery plugin |
Implements mbf_abstract_nav::AbstractNavigationServer.
Definition at line 251 of file costmap_navigation_server.cpp.
|
privatevirtual |
Create a new controller execution.
plugin_name | Name of the controller to use. |
plugin_ptr | Shared pointer to the plugin to use. |
Definition at line 115 of file costmap_navigation_server.cpp.
|
privatevirtual |
Create a new planner execution.
plugin_name | Name of the planner to use. |
plugin_ptr | Shared pointer to the plugin to use. |
Definition at line 104 of file costmap_navigation_server.cpp.
|
privatevirtual |
Create a new recovery behavior execution.
plugin_name | Name of the recovery behavior to run. |
plugin_ptr | Shared pointer to the plugin to use |
Definition at line 129 of file costmap_navigation_server.cpp.
|
private |
Reconfiguration method called by dynamic reconfigure.
config | Configuration parameters. See the MoveBaseFlexConfig definition. |
level | bit mask, which parameters are set. |
Definition at line 328 of file costmap_navigation_server.cpp.
|
virtual |
Reimplemented from mbf_abstract_nav::AbstractNavigationServer.
Definition at line 320 of file costmap_navigation_server.cpp.
|
private |
Service Server for the check_path_cost service.
Definition at line 260 of file costmap_navigation_server.h.
|
private |
Service Server for the check_point_cost service.
Definition at line 254 of file costmap_navigation_server.h.
|
private |
Service Server for the check_pose_cost service.
Definition at line 257 of file costmap_navigation_server.h.
|
private |
Service Server for the clear_costmap service.
Definition at line 263 of file costmap_navigation_server.h.
|
private |
Definition at line 230 of file costmap_navigation_server.h.
|
private |
the default parameter configuration save
Definition at line 242 of file costmap_navigation_server.h.
|
private |
Dynamic reconfigure server for the mbf_costmap2d_specific part.
Definition at line 236 of file costmap_navigation_server.h.
|
private |
Shared pointer to the common global costmap.
Definition at line 251 of file costmap_navigation_server.h.
|
private |
last configuration save
Definition at line 239 of file costmap_navigation_server.h.
|
private |
Shared pointer to the common local costmap.
Definition at line 248 of file costmap_navigation_server.h.
|
private |
Definition at line 231 of file costmap_navigation_server.h.
|
private |
Definition at line 233 of file costmap_navigation_server.h.
|
private |
Definition at line 229 of file costmap_navigation_server.h.
|
private |
Definition at line 232 of file costmap_navigation_server.h.
|
private |
Definition at line 228 of file costmap_navigation_server.h.
|
private |
true, if the dynamic reconfigure has been setup
Definition at line 245 of file costmap_navigation_server.h.