moveit2
The MoveIt Motion Planning Framework for ROS 2.
|
Planner parameters provided with the MotionPlanRequest. More...
#include <planning_component.h>
Public Member Functions | |
template<typename T > | |
void | declareOrGetParam (const rclcpp::Node::SharedPtr &node, const std::string ¶m_name, T &output_value, T default_value) |
void | load (const rclcpp::Node::SharedPtr &node, const std::string ¶m_namespace="") |
Public Attributes | |
std::string | planner_id |
std::string | planning_pipeline |
int | planning_attempts |
double | planning_time |
double | max_velocity_scaling_factor |
double | max_acceleration_scaling_factor |
Planner parameters provided with the MotionPlanRequest.
Definition at line 59 of file planning_component.h.
|
inline |
Definition at line 69 of file planning_component.h.
|
inline |
double moveit_cpp::PlanningComponent::PlanRequestParameters::max_acceleration_scaling_factor |
Definition at line 66 of file planning_component.h.
double moveit_cpp::PlanningComponent::PlanRequestParameters::max_velocity_scaling_factor |
Definition at line 65 of file planning_component.h.
std::string moveit_cpp::PlanningComponent::PlanRequestParameters::planner_id |
Definition at line 61 of file planning_component.h.
int moveit_cpp::PlanningComponent::PlanRequestParameters::planning_attempts |
Definition at line 63 of file planning_component.h.
std::string moveit_cpp::PlanningComponent::PlanRequestParameters::planning_pipeline |
Definition at line 62 of file planning_component.h.
double moveit_cpp::PlanningComponent::PlanRequestParameters::planning_time |
Definition at line 64 of file planning_component.h.