moveit2
The MoveIt Motion Planning Framework for ROS 2.
|
Planner parameters provided with the MotionPlanRequest. More...
#include <planning_component.h>
Public Member Functions | |
MultiPipelinePlanRequestParameters (const rclcpp::Node::SharedPtr &node, const std::vector< std::string > &planning_pipeline_names) | |
MultiPipelinePlanRequestParameters () | |
Public Attributes | |
std::vector< PlanRequestParameters > | plan_request_parameter_vector |
Planner parameters provided with the MotionPlanRequest.
Definition at line 102 of file planning_component.h.
|
inline |
Constructor, load MultiPipelinePlanRequestParameters as defined in the node's ROS parameters
[in] | node | Node access the ROS parameters |
[in] | planning_pipeline_names | A vector with the names of the pipelines that should be used in parallel |
Definition at line 108 of file planning_component.h.
|
inline |
Definition at line 122 of file planning_component.h.
std::vector<PlanRequestParameters> moveit_cpp::PlanningComponent::MultiPipelinePlanRequestParameters::plan_request_parameter_vector |
Definition at line 127 of file planning_component.h.