26 #ifndef STOMP_MOVEIT_STOMP_PLANNER_MANAGER_H_ 27 #define STOMP_MOVEIT_STOMP_PLANNER_MANAGER_H_ 58 bool initialize(
const robot_model::RobotModelConstPtr& model,
const std::string &ns)
override;
73 return "Stomp Planner";
98 moveit_msgs::MoveItErrorCodes &error_code)
const override;
105 std::map< std::string, planning_interface::PlanningContextPtr>
planners_;
108 moveit::core::RobotModelConstPtr robot_model_;
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.
std::map< std::string, planning_interface::PlanningContextPtr > planners_
StompPlannerManager()
Constructor.
std::map< std::string, PlannerConfigurationSettings > PlannerConfigurationMap
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.
std::string getDescription() const override
Description string getter.
The PlannerManager implementation that loads STOMP into moveit.
void setPlannerConfigurations(const planning_interface::PlannerConfigurationMap &pcs) override
Not applicable.
void getPlanningAlgorithms(std::vector< std::string > &algs) const override
Getter for a list of the available planners, usually one STOMP planner per planning group...
bool canServiceRequest(const moveit_msgs::MotionPlanRequest &req) const override
Checks if the request can be planned for.
moveit_msgs::MotionPlanRequest MotionPlanRequest