moveit2
The MoveIt Motion Planning Framework for ROS 2.
Public Member Functions | Public Attributes | List of all members
moveit_cpp::MoveItCpp::PlanningSceneMonitorOptions Struct Reference

Specification of options to use when constructing the MoveItCpp class. More...

#include <moveit_cpp.h>

Public Member Functions

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

Public Attributes

std::string name
 
std::string robot_description
 
std::string joint_state_topic
 
std::string attached_collision_object_topic
 
std::string monitored_planning_scene_topic
 
std::string publish_planning_scene_topic
 
double wait_for_initial_state_timeout
 

Detailed Description

Specification of options to use when constructing the MoveItCpp class.

Definition at line 58 of file moveit_cpp.h.

Member Function Documentation

◆ load()

void moveit_cpp::MoveItCpp::PlanningSceneMonitorOptions::load ( const rclcpp::Node::SharedPtr &  node)
inline

Definition at line 60 of file moveit_cpp.h.

Here is the caller graph for this function:

Member Data Documentation

◆ attached_collision_object_topic

std::string moveit_cpp::MoveItCpp::PlanningSceneMonitorOptions::attached_collision_object_topic

Definition at line 78 of file moveit_cpp.h.

◆ joint_state_topic

std::string moveit_cpp::MoveItCpp::PlanningSceneMonitorOptions::joint_state_topic

Definition at line 77 of file moveit_cpp.h.

◆ monitored_planning_scene_topic

std::string moveit_cpp::MoveItCpp::PlanningSceneMonitorOptions::monitored_planning_scene_topic

Definition at line 79 of file moveit_cpp.h.

◆ name

std::string moveit_cpp::MoveItCpp::PlanningSceneMonitorOptions::name

Definition at line 75 of file moveit_cpp.h.

◆ publish_planning_scene_topic

std::string moveit_cpp::MoveItCpp::PlanningSceneMonitorOptions::publish_planning_scene_topic

Definition at line 80 of file moveit_cpp.h.

◆ robot_description

std::string moveit_cpp::MoveItCpp::PlanningSceneMonitorOptions::robot_description

Definition at line 76 of file moveit_cpp.h.

◆ wait_for_initial_state_timeout

double moveit_cpp::MoveItCpp::PlanningSceneMonitorOptions::wait_for_initial_state_timeout

Definition at line 81 of file moveit_cpp.h.


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