|
moveit2
The MoveIt Motion Planning Framework for ROS 2.
|
Classes | |
| class | CurrentStateMonitor |
| Monitors the joint_states topic and tf to maintain the current state of the robot. More... | |
| class | CurrentStateMonitorMiddlewareHandle |
| This class contains the ros interfaces for CurrentStateMontior. More... | |
| class | PlanningSceneMonitor |
| PlanningSceneMonitor Subscribes to the topic planning_scene. More... | |
| class | LockedPlanningSceneRO |
| This is a convenience class for obtaining access to an instance of a locked PlanningScene. More... | |
| class | LockedPlanningSceneRW |
| This is a convenience class for obtaining access to an instance of a locked PlanningScene. More... | |
| class | TrajectoryMonitor |
| Monitors the joint_states topic and tf to record the trajectory of the robot. More... | |
| class | TrajectoryMonitorMiddlewareHandle |
| This class contains the ROS2 interfaces for TrajectoryMonitor. This class is useful for testing by mocking the functions in the class below. More... | |
| class | TestGTestWaitForCompletion |
| class | TestGTestProcessPostShutdown |
Typedefs | |
| using | JointStateUpdateCallback = std::function< void(sensor_msgs::msg::JointState::ConstSharedPtr)> |
| using | TrajectoryStateAddedCallback = std::function< void(const moveit::core::RobotStateConstPtr &, const rclcpp::Time &)> |
Functions | |
| MOVEIT_CLASS_FORWARD (PlanningSceneMonitor) | |
| MOVEIT_CLASS_FORWARD (CurrentStateMonitor) | |
| MOVEIT_CLASS_FORWARD (TrajectoryMonitor) | |
| def | generate_test_description () |
| using planning_scene_monitor::JointStateUpdateCallback = typedef std::function<void(sensor_msgs::msg::JointState::ConstSharedPtr)> |
Definition at line 57 of file current_state_monitor.h.
| using planning_scene_monitor::TrajectoryStateAddedCallback = typedef std::function<void(const moveit::core::RobotStateConstPtr&, const rclcpp::Time&)> |
Definition at line 50 of file trajectory_monitor.h.
| def planning_scene_monitor.generate_test_description | ( | ) |
Definition at line 10 of file planning_scene_monitor.test.py.

| planning_scene_monitor::MOVEIT_CLASS_FORWARD | ( | CurrentStateMonitor | ) |
| planning_scene_monitor::MOVEIT_CLASS_FORWARD | ( | PlanningSceneMonitor | ) |
| planning_scene_monitor::MOVEIT_CLASS_FORWARD | ( | TrajectoryMonitor | ) |