moveit2
The MoveIt Motion Planning Framework for ROS 2.
|
Public Member Functions | |
CHOMPPlannerManager () | |
bool | initialize (const moveit::core::RobotModelConstPtr &model, const rclcpp::Node::SharedPtr &node, const std::string &) override |
planning_interface::PlanningContextPtr | getPlanningContext (const planning_scene::PlanningSceneConstPtr &planning_scene, const planning_interface::MotionPlanRequest &req, moveit_msgs::msg::MoveItErrorCodes &error_code) const override |
Construct a planning context given the current scene and a planning request. If a problem is encountered, error code is set and empty ptr is returned. The returned motion planner context is clean – the motion planner will start from scratch every time a context is constructed. | |
bool | canServiceRequest (const planning_interface::MotionPlanRequest &) const override |
Determine whether this plugin instance is able to represent this planning request. | |
std::string | getDescription () const override |
Get a short string that identifies the planning interface. | |
void | getPlanningAlgorithms (std::vector< std::string > &algs) const override |
Get the names of the known planning algorithms (values that can be filled as planner_id in the planning request) | |
Public Member Functions inherited from planning_interface::PlannerManager | |
PlannerManager () | |
virtual | ~PlannerManager () |
PlanningContextPtr | getPlanningContext (const planning_scene::PlanningSceneConstPtr &planning_scene, const MotionPlanRequest &req) const |
Calls the function above but ignores the error_code. | |
virtual void | setPlannerConfigurations (const PlannerConfigurationMap &pcs) |
Specify the settings to be used for specific algorithms. | |
const PlannerConfigurationMap & | getPlannerConfigurations () const |
Get the settings for a specific algorithm. | |
void | terminate () const |
Request termination, if a solve() function is currently computing plans. | |
Protected Attributes | |
std::map< std::string, CHOMPPlanningContextPtr > | planning_contexts_ |
Protected Attributes inherited from planning_interface::PlannerManager | |
PlannerConfigurationMap | config_settings_ |
All the existing planning configurations. The name of the configuration is the key of the map. This name can be of the form "group_name[config_name]" if there are particular configurations specified for a group, or of the form "group_name" if default settings are to be used. | |
Definition at line 55 of file chomp_plugin.cpp.
|
inline |
Definition at line 58 of file chomp_plugin.cpp.
|
inlineoverridevirtual |
Determine whether this plugin instance is able to represent this planning request.
Implements planning_interface::PlannerManager.
Definition at line 105 of file chomp_plugin.cpp.
|
inlineoverridevirtual |
Get a short string that identifies the planning interface.
Implements planning_interface::PlannerManager.
Definition at line 112 of file chomp_plugin.cpp.
|
inlineoverridevirtual |
Get the names of the known planning algorithms (values that can be filled as planner_id in the planning request)
Reimplemented from planning_interface::PlannerManager.
Definition at line 117 of file chomp_plugin.cpp.
|
inlineoverridevirtual |
Construct a planning context given the current scene and a planning request. If a problem is encountered, error code is set and empty ptr is returned. The returned motion planner context is clean – the motion planner will start from scratch every time a context is constructed.
planning_scene | A const planning scene to use for planning |
req | The representation of the planning request |
error_code | This is where the error is set if constructing the planning context fails |
Implements planning_interface::PlannerManager.
Definition at line 73 of file chomp_plugin.cpp.
|
inlineoverridevirtual |
Initialize a planner. This function will be called after the construction of the plugin, before any other call is made. It is assumed that motion plans will be computed for the robot described by model and that any exposed ROS functionality or required ROS parameters are namespaced by parameter_namespace
Reimplemented from planning_interface::PlannerManager.
Definition at line 62 of file chomp_plugin.cpp.
|
protected |
Definition at line 124 of file chomp_plugin.cpp.