37 #ifndef MOVEIT_PLANNING_INTERFACE_PLANNING_INTERFACE_ 38 #define MOVEIT_PLANNING_INTERFACE_PLANNING_INTERFACE_ 71 std::map<std::string, std::string>
config;
104 return planning_scene_;
114 void setPlanningScene(
const planning_scene::PlanningSceneConstPtr&
planning_scene);
129 virtual bool terminate() = 0;
132 virtual void clear() = 0;
167 virtual bool initialize(
const robot_model::RobotModelConstPtr& model,
const std::string& ns);
170 virtual std::string getDescription()
const;
174 virtual void getPlanningAlgorithms(std::vector<std::string>& algs)
const;
183 virtual PlanningContextPtr getPlanningContext(
const planning_scene::PlanningSceneConstPtr&
planning_scene,
185 moveit_msgs::MoveItErrorCodes& error_code)
const = 0;
188 PlanningContextPtr getPlanningContext(
const planning_scene::PlanningSceneConstPtr& planning_scene,
195 virtual void setPlannerConfigurations(
const PlannerConfigurationMap& pcs);
200 return config_settings_;
204 void terminate()
const;
MOVEIT_CLASS_FORWARD(PlanningScene)
ROSCONSOLE_DECL void initialize()
virtual ~PlannerManager()
Specify the settings for a particular planning algorithm, for a particular group. The Planner plugin ...
std::map< std::string, PlannerConfigurationSettings > PlannerConfigurationMap
Map from PlannerConfigurationSettings.name to PlannerConfigurationSettings.
const PlannerConfigurationMap & getPlannerConfigurations() const
Get the settings for a specific algorithm.
std::map< std::string, std::string > config
Key-value pairs of settings that get passed to the planning algorithm.
Representation of a particular planning context – the planning scene and the request are known...
const planning_scene::PlanningSceneConstPtr & getPlanningScene() const
Get the planning scene associated to this planning context.
std::string group_
The group (as in the SRDF) this planning context is for.
planning_scene::PlanningSceneConstPtr planning_scene_
The planning scene for this context.
This class maintains the representation of the environment as seen by a planning instance. The environment geometry, the robot geometry and state are maintained.
const std::string & getGroupName() const
Get the name of the group this planning context is for.
This namespace includes the central class for representing planning contexts.
moveit_msgs::MotionPlanRequest MotionPlanRequest
const MotionPlanRequest & getMotionPlanRequest() const
Get the motion plan request associated to this planning context.
const std::string & getName() const
Get the name of this planning context.
std::string group
The group (as defined in the SRDF) this configuration is meant for.
std::string name_
The name of this planning context.
This namespace includes the base class for MoveIt! planners.
MotionPlanRequest request_
The planning request for this context.
Base class for a MoveIt! planner.
PlannerConfigurationMap config_settings_
All the existing planning configurations. The name of the configuration is the key of the map...