Simple interface to MoveIt components. More...
Classes | |
class | MoveGroupInterface |
Client class to conveniently use the ROS interfaces provided by the move_group node. More... | |
class | MoveItCpp |
class | MoveItCppTest |
class | MoveItErrorCode |
class | PlanningComponent |
class | PlanningSceneInterface |
Functions | |
moveit::core::RobotModelConstPtr | getSharedRobotModel (const std::string &robot_description) |
planning_scene_monitor::CurrentStateMonitorPtr | getSharedStateMonitor (const moveit::core::RobotModelConstPtr &robot_model, const std::shared_ptr< tf2_ros::Buffer > &tf_buffer) |
getSharedStateMonitor is a simpler version of getSharedStateMonitor(const moveit::core::RobotModelConstPtr &robot_model, const std::shared_ptr<tf2_ros::Buffer>& tf_buffer, ros::NodeHandle nh = ros::NodeHandle() ). It calls this function using the default constructed ros::NodeHandle More... | |
planning_scene_monitor::CurrentStateMonitorPtr | getSharedStateMonitor (const moveit::core::RobotModelConstPtr &robot_model, const std::shared_ptr< tf2_ros::Buffer > &tf_buffer, const ros::NodeHandle &nh) |
getSharedStateMonitor More... | |
std::shared_ptr< tf2_ros::Buffer > | getSharedTF () |
MOVEIT_CLASS_FORWARD (MoveGroupInterface) | |
MOVEIT_CLASS_FORWARD (MoveItCpp) | |
MOVEIT_CLASS_FORWARD (PlanningComponent) | |
MOVEIT_CLASS_FORWARD (PlanningSceneInterface) | |
TEST_F (MoveItCppTest, GetCurrentStateTest) | |
TEST_F (MoveItCppTest, NameOfPlanningGroupTest) | |
TEST_F (MoveItCppTest, TestSetGoalFromPoseStamped) | |
TEST_F (MoveItCppTest, TestSetGoalFromRobotState) | |
TEST_F (MoveItCppTest, TestSetStartStateFromRobotState) | |
TEST_F (MoveItCppTest, TestSetStartStateToCurrentState) | |
Variables | |
const std::string | GRASP_PLANNING_SERVICE_NAME = "plan_grasps" |
const std::string | LOGNAME = "move_group_interface" |
constexpr char | PLANNING_PLUGIN_PARAM [] = "planning_plugin" |
Simple interface to MoveIt components.
moveit::core::RobotModelConstPtr moveit::planning_interface::getSharedRobotModel | ( | const std::string & | robot_description | ) |
Definition at line 116 of file common_objects.cpp.
CurrentStateMonitorPtr moveit::planning_interface::getSharedStateMonitor | ( | const moveit::core::RobotModelConstPtr & | robot_model, |
const std::shared_ptr< tf2_ros::Buffer > & | tf_buffer | ||
) |
getSharedStateMonitor is a simpler version of getSharedStateMonitor(const moveit::core::RobotModelConstPtr &robot_model, const std::shared_ptr<tf2_ros::Buffer>& tf_buffer, ros::NodeHandle nh = ros::NodeHandle() ). It calls this function using the default constructed ros::NodeHandle
robot_model | |
tf_buffer |
Definition at line 134 of file common_objects.cpp.
CurrentStateMonitorPtr moveit::planning_interface::getSharedStateMonitor | ( | const moveit::core::RobotModelConstPtr & | robot_model, |
const std::shared_ptr< tf2_ros::Buffer > & | tf_buffer, | ||
const ros::NodeHandle & | nh | ||
) |
getSharedStateMonitor
robot_model | |
tf_buffer | |
nh | A ros::NodeHandle to pass node specific configurations, such as callbacks queues. |
Definition at line 140 of file common_objects.cpp.
std::shared_ptr< tf2_ros::Buffer > moveit::planning_interface::getSharedTF | ( | ) |
Definition at line 99 of file common_objects.cpp.
moveit::planning_interface::MOVEIT_CLASS_FORWARD | ( | MoveGroupInterface | ) |
moveit::planning_interface::MOVEIT_CLASS_FORWARD | ( | MoveItCpp | ) |
moveit::planning_interface::MOVEIT_CLASS_FORWARD | ( | PlanningComponent | ) |
moveit::planning_interface::MOVEIT_CLASS_FORWARD | ( | PlanningSceneInterface | ) |
moveit::planning_interface::TEST_F | ( | MoveItCppTest | , |
GetCurrentStateTest | |||
) |
Definition at line 160 of file moveit_cpp_test.cpp.
moveit::planning_interface::TEST_F | ( | MoveItCppTest | , |
NameOfPlanningGroupTest | |||
) |
Definition at line 179 of file moveit_cpp_test.cpp.
moveit::planning_interface::TEST_F | ( | MoveItCppTest | , |
TestSetGoalFromPoseStamped | |||
) |
Definition at line 195 of file moveit_cpp_test.cpp.
moveit::planning_interface::TEST_F | ( | MoveItCppTest | , |
TestSetGoalFromRobotState | |||
) |
Definition at line 215 of file moveit_cpp_test.cpp.
moveit::planning_interface::TEST_F | ( | MoveItCppTest | , |
TestSetStartStateFromRobotState | |||
) |
Definition at line 203 of file moveit_cpp_test.cpp.
moveit::planning_interface::TEST_F | ( | MoveItCppTest | , |
TestSetStartStateToCurrentState | |||
) |
Definition at line 185 of file moveit_cpp_test.cpp.
const std::string moveit::planning_interface::GRASP_PLANNING_SERVICE_NAME = "plan_grasps" |
Definition at line 146 of file move_group_interface.cpp.
|
constexpr |
Definition at line 148 of file move_group_interface.cpp.
|
constexpr |
Definition at line 116 of file moveit_cpp.cpp.