|
moveit2
The MoveIt Motion Planning Framework for ROS 2.
|
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 | PlanningSceneInterface |
| class | MoveItCppTest |
Typedefs | |
| using | MoveItCpp = moveit_cpp::MoveItCpp |
| using | PlanningComponent = moveit_cpp::PlanningComponent |
| using | MoveItErrorCode = moveit::core::MoveItErrorCode |
Functions | |
| MOVEIT_DECLARE_PTR (MoveItCpp, moveit_cpp::MoveItCpp) | |
| MOVEIT_DECLARE_PTR (PlanningComponent, moveit_cpp::PlanningComponent) | |
| std::shared_ptr< tf2_ros::Buffer > | getSharedTF () |
| robot_model_loader::RobotModelLoaderPtr | getSharedRobotModelLoader (const rclcpp::Node::SharedPtr &node, const std::string &robot_description) |
| moveit::core::RobotModelConstPtr | getSharedRobotModel (const rclcpp::Node::SharedPtr &node, const std::string &robot_description) |
| planning_scene_monitor::CurrentStateMonitorPtr | getSharedStateMonitor (const rclcpp::Node::SharedPtr &node, const moveit::core::RobotModelConstPtr &robot_model, const std::shared_ptr< tf2_ros::Buffer > &tf_buffer) |
| getSharedStateMonitor More... | |
| MOVEIT_CLASS_FORWARD (MoveGroupInterface) | |
| MOVEIT_CLASS_FORWARD (PlanningSceneInterface) | |
| TEST_F (MoveItCppTest, GetCurrentStateTest) | |
| TEST_F (MoveItCppTest, NameOfPlanningGroupTest) | |
| TEST_F (MoveItCppTest, TestSetStartStateToCurrentState) | |
| TEST_F (MoveItCppTest, TestSetGoalFromPoseStamped) | |
| TEST_F (MoveItCppTest, TestSetStartStateFromRobotState) | |
| TEST_F (MoveItCppTest, TestSetGoalFromRobotState) | |
Variables | |
| const std::string | GRASP_PLANNING_SERVICE_NAME = "plan_grasps" |
| const rclcpp::Logger | LOGGER = rclcpp::get_logger("move_group_interface") |
Simple interface to MoveIt components.
| using moveit::planning_interface::MoveItCpp = typedef moveit_cpp::MoveItCpp |
Definition at line 204 of file moveit_cpp.h.
Definition at line 71 of file move_group_interface.h.
Definition at line 205 of file planning_component.h.
| moveit::core::RobotModelConstPtr moveit::planning_interface::getSharedRobotModel | ( | const rclcpp::Node::SharedPtr & | node, |
| const std::string & | robot_description | ||
| ) |
Definition at line 115 of file common_objects.cpp.


| robot_model_loader::RobotModelLoaderPtr moveit::planning_interface::getSharedRobotModelLoader | ( | const rclcpp::Node::SharedPtr & | node, |
| const std::string & | robot_description | ||
| ) |
| CurrentStateMonitorPtr moveit::planning_interface::getSharedStateMonitor | ( | const rclcpp::Node::SharedPtr & | node, |
| const moveit::core::RobotModelConstPtr & | robot_model, | ||
| const std::shared_ptr< tf2_ros::Buffer > & | tf_buffer | ||
| ) |
getSharedStateMonitor
| node | A rclcpp::Node::SharePtr to pass node specific configurations, such as callbacks queues. |
| robot_model | |
| tf_buffer |
Definition at line 132 of file common_objects.cpp.

| std::shared_ptr< tf2_ros::Buffer > moveit::planning_interface::getSharedTF | ( | ) |
| moveit::planning_interface::MOVEIT_CLASS_FORWARD | ( | MoveGroupInterface | ) |
| moveit::planning_interface::MOVEIT_CLASS_FORWARD | ( | PlanningSceneInterface | ) |
| moveit::planning_interface::MOVEIT_DECLARE_PTR | ( | MoveItCpp | , |
| moveit_cpp::MoveItCpp | |||
| ) |
| moveit::planning_interface::MOVEIT_DECLARE_PTR | ( | PlanningComponent | , |
| moveit_cpp::PlanningComponent | |||
| ) |
| moveit::planning_interface::TEST_F | ( | MoveItCppTest | , |
| GetCurrentStateTest | |||
| ) |
Definition at line 102 of file moveit_cpp_test.cpp.
| moveit::planning_interface::TEST_F | ( | MoveItCppTest | , |
| NameOfPlanningGroupTest | |||
| ) |
Definition at line 121 of file moveit_cpp_test.cpp.
| moveit::planning_interface::TEST_F | ( | MoveItCppTest | , |
| TestSetGoalFromPoseStamped | |||
| ) |
Definition at line 137 of file moveit_cpp_test.cpp.
| moveit::planning_interface::TEST_F | ( | MoveItCppTest | , |
| TestSetGoalFromRobotState | |||
| ) |
Definition at line 157 of file moveit_cpp_test.cpp.
| moveit::planning_interface::TEST_F | ( | MoveItCppTest | , |
| TestSetStartStateFromRobotState | |||
| ) |
Definition at line 145 of file moveit_cpp_test.cpp.
| moveit::planning_interface::TEST_F | ( | MoveItCppTest | , |
| TestSetStartStateToCurrentState | |||
| ) |
Definition at line 127 of file moveit_cpp_test.cpp.
| const std::string moveit::planning_interface::GRASP_PLANNING_SERVICE_NAME = "plan_grasps" |
Definition at line 79 of file move_group_interface.cpp.
| static const rclcpp::Logger moveit::planning_interface::LOGGER = rclcpp::get_logger("move_group_interface") |
Definition at line 80 of file move_group_interface.cpp.