The PlannerManager implementation that loads STOMP into moveit. More...
#include <stomp_planner_manager.h>
Public Member Functions | |
bool | canServiceRequest (const moveit_msgs::MotionPlanRequest &req) const override |
Checks if the request can be planned for. More... | |
std::string | getDescription () const override |
Description string getter. More... | |
void | getPlanningAlgorithms (std::vector< std::string > &algs) const override |
Getter for a list of the available planners, usually one STOMP planner per planning group. More... | |
planning_interface::PlanningContextPtr | getPlanningContext (const planning_scene::PlanningSceneConstPtr &planning_scene, const planning_interface::MotionPlanRequest &req, moveit_msgs::MoveItErrorCodes &error_code) const override |
Provides a planning context that matches the desired plan requests specifications. More... | |
bool | initialize (const robot_model::RobotModelConstPtr &model, const std::string &ns) override |
Loads the ros parameters for each planning group and initializes the all the planners. More... | |
void | setPlannerConfigurations (const planning_interface::PlannerConfigurationMap &pcs) override |
Not applicable. More... | |
StompPlannerManager () | |
Constructor. | |
Public Member Functions inherited from planning_interface::PlannerManager | |
const PlannerConfigurationMap & | getPlannerConfigurations () const |
PlanningContextPtr | getPlanningContext (const planning_scene::PlanningSceneConstPtr &planning_scene, const MotionPlanRequest &req) const |
void | terminate () const |
Protected Attributes | |
ros::NodeHandle | nh_ |
std::map< std::string, planning_interface::PlanningContextPtr > | planners_ |
moveit::core::RobotModelConstPtr | robot_model_ |
Protected Attributes inherited from planning_interface::PlannerManager | |
PlannerConfigurationMap | config_settings_ |
The PlannerManager implementation that loads STOMP into moveit.
Definition at line 42 of file stomp_planner_manager.h.
|
overridevirtual |
Checks if the request can be planned for.
req |
Implements planning_interface::PlannerManager.
Definition at line 84 of file stomp_planner_manager.cpp.
|
inlineoverridevirtual |
Description string getter.
Reimplemented from planning_interface::PlannerManager.
Definition at line 71 of file stomp_planner_manager.h.
|
overridevirtual |
Getter for a list of the available planners, usually one STOMP planner per planning group.
algs | List of available planners. |
Reimplemented from planning_interface::PlannerManager.
Definition at line 96 of file stomp_planner_manager.cpp.
|
overridevirtual |
Provides a planning context that matches the desired plan requests specifications.
planning_scene | A pointer to the planning scene |
req | The motion plan request |
error_code | Error code, will be set to moveit_msgs::MoveItErrorCodes::SUCCESS if it succeeded |
Implements planning_interface::PlannerManager.
Definition at line 110 of file stomp_planner_manager.cpp.
|
overridevirtual |
Loads the ros parameters for each planning group and initializes the all the planners.
model | The robot model |
ns | The parameter namespace |
Reimplemented from planning_interface::PlannerManager.
Definition at line 45 of file stomp_planner_manager.cpp.
|
overridevirtual |
Not applicable.
pcs | this argument is ignored. |
Reimplemented from planning_interface::PlannerManager.
Definition at line 105 of file stomp_planner_manager.cpp.
|
protected |
The planners for each planning group
Definition at line 105 of file stomp_planner_manager.h.