moveit2
The MoveIt Motion Planning Framework for ROS 2.
|
#include <moveit/macros/class_forward.h>
#include <moveit/robot_state/robot_state.h>
#include <moveit/planning_scene_monitor/current_state_monitor.h>
#include <moveit/robot_trajectory/robot_trajectory.h>
#include <rclcpp/time.hpp>
#include <memory>
#include <functional>
#include <thread>
Go to the source code of this file.
Classes | |
class | planning_scene_monitor::TrajectoryMonitor |
Monitors the joint_states topic and tf to record the trajectory of the robot. More... | |
class | planning_scene_monitor::TrajectoryMonitor::MiddlewareHandle |
This class contains the rcl interfaces for easier testing. More... | |
Namespaces | |
namespace | planning_scene_monitor |
Typedefs | |
using | planning_scene_monitor::TrajectoryStateAddedCallback = std::function< void(const moveit::core::RobotStateConstPtr &, const rclcpp::Time &)> |
Functions | |
planning_scene_monitor::MOVEIT_CLASS_FORWARD (TrajectoryMonitor) | |