moveit2
The MoveIt Motion Planning Framework for ROS 2.
Public Member Functions | Public Attributes | List of all members
moveit::hybrid_planning::LocalPlannerComponent::LocalPlannerConfig Struct Reference

Struct that contains configuration of the local planner component node. More...

#include <local_planner_component.h>

Public Member Functions

void load (const rclcpp::Node::SharedPtr &node)
 

Public Attributes

std::string group_name
 
std::string robot_description
 
std::string robot_description_semantic
 
std::string publish_planning_scene_topic
 
std::string trajectory_operator_plugin_name
 
std::string local_constraint_solver_plugin_name
 
std::string local_planning_action_name
 
std::string global_solution_topic
 
std::string local_solution_topic
 
std::string local_solution_topic_type
 
bool publish_joint_positions
 
bool publish_joint_velocities
 
double local_planning_frequency
 
std::string monitored_planning_scene_topic
 
std::string collision_object_topic
 
std::string joint_states_topic
 

Detailed Description

Struct that contains configuration of the local planner component node.

Definition at line 104 of file local_planner_component.h.

Member Function Documentation

◆ load()

void moveit::hybrid_planning::LocalPlannerComponent::LocalPlannerConfig::load ( const rclcpp::Node::SharedPtr &  node)
inline

Definition at line 106 of file local_planner_component.h.

Here is the caller graph for this function:

Member Data Documentation

◆ collision_object_topic

std::string moveit::hybrid_planning::LocalPlannerComponent::LocalPlannerConfig::collision_object_topic

Definition at line 141 of file local_planner_component.h.

◆ global_solution_topic

std::string moveit::hybrid_planning::LocalPlannerComponent::LocalPlannerConfig::global_solution_topic

Definition at line 134 of file local_planner_component.h.

◆ group_name

std::string moveit::hybrid_planning::LocalPlannerComponent::LocalPlannerConfig::group_name

Definition at line 127 of file local_planner_component.h.

◆ joint_states_topic

std::string moveit::hybrid_planning::LocalPlannerComponent::LocalPlannerConfig::joint_states_topic

Definition at line 142 of file local_planner_component.h.

◆ local_constraint_solver_plugin_name

std::string moveit::hybrid_planning::LocalPlannerComponent::LocalPlannerConfig::local_constraint_solver_plugin_name

Definition at line 132 of file local_planner_component.h.

◆ local_planning_action_name

std::string moveit::hybrid_planning::LocalPlannerComponent::LocalPlannerConfig::local_planning_action_name

Definition at line 133 of file local_planner_component.h.

◆ local_planning_frequency

double moveit::hybrid_planning::LocalPlannerComponent::LocalPlannerConfig::local_planning_frequency

Definition at line 139 of file local_planner_component.h.

◆ local_solution_topic

std::string moveit::hybrid_planning::LocalPlannerComponent::LocalPlannerConfig::local_solution_topic

Definition at line 135 of file local_planner_component.h.

◆ local_solution_topic_type

std::string moveit::hybrid_planning::LocalPlannerComponent::LocalPlannerConfig::local_solution_topic_type

Definition at line 136 of file local_planner_component.h.

◆ monitored_planning_scene_topic

std::string moveit::hybrid_planning::LocalPlannerComponent::LocalPlannerConfig::monitored_planning_scene_topic

Definition at line 140 of file local_planner_component.h.

◆ publish_joint_positions

bool moveit::hybrid_planning::LocalPlannerComponent::LocalPlannerConfig::publish_joint_positions

Definition at line 137 of file local_planner_component.h.

◆ publish_joint_velocities

bool moveit::hybrid_planning::LocalPlannerComponent::LocalPlannerConfig::publish_joint_velocities

Definition at line 138 of file local_planner_component.h.

◆ publish_planning_scene_topic

std::string moveit::hybrid_planning::LocalPlannerComponent::LocalPlannerConfig::publish_planning_scene_topic

Definition at line 130 of file local_planner_component.h.

◆ robot_description

std::string moveit::hybrid_planning::LocalPlannerComponent::LocalPlannerConfig::robot_description

Definition at line 128 of file local_planner_component.h.

◆ robot_description_semantic

std::string moveit::hybrid_planning::LocalPlannerComponent::LocalPlannerConfig::robot_description_semantic

Definition at line 129 of file local_planner_component.h.

◆ trajectory_operator_plugin_name

std::string moveit::hybrid_planning::LocalPlannerComponent::LocalPlannerConfig::trajectory_operator_plugin_name

Definition at line 131 of file local_planner_component.h.


The documentation for this struct was generated from the following file: