Specification of options to use when constructing the MoveItCpp class. More...
#include <moveit_cpp.h>
Public Member Functions | |
void | load (const ros::NodeHandle &nh) |
Public Attributes | |
std::string | attached_collision_object_topic |
std::string | joint_state_topic |
std::string | monitored_planning_scene_topic |
std::string | name |
std::string | publish_planning_scene_topic |
std::string | robot_description |
double | wait_for_initial_state_timeout |
Specification of options to use when constructing the MoveItCpp class.
Definition at line 90 of file moveit_cpp.h.
|
inline |
Definition at line 92 of file moveit_cpp.h.
std::string moveit_cpp::MoveItCpp::PlanningSceneMonitorOptions::attached_collision_object_topic |
Definition at line 110 of file moveit_cpp.h.
std::string moveit_cpp::MoveItCpp::PlanningSceneMonitorOptions::joint_state_topic |
Definition at line 109 of file moveit_cpp.h.
std::string moveit_cpp::MoveItCpp::PlanningSceneMonitorOptions::monitored_planning_scene_topic |
Definition at line 111 of file moveit_cpp.h.
std::string moveit_cpp::MoveItCpp::PlanningSceneMonitorOptions::name |
Definition at line 107 of file moveit_cpp.h.
std::string moveit_cpp::MoveItCpp::PlanningSceneMonitorOptions::publish_planning_scene_topic |
Definition at line 112 of file moveit_cpp.h.
std::string moveit_cpp::MoveItCpp::PlanningSceneMonitorOptions::robot_description |
Definition at line 108 of file moveit_cpp.h.
double moveit_cpp::MoveItCpp::PlanningSceneMonitorOptions::wait_for_initial_state_timeout |
Definition at line 113 of file moveit_cpp.h.