moveit2
The MoveIt Motion Planning Framework for ROS 2.
Classes | Namespaces | Typedefs | Functions
current_state_monitor.h File Reference
#include <chrono>
#include <functional>
#include <string>
#include <condition_variable>
#include <mutex>
#include <boost/signals2.hpp>
#include <rclcpp/rclcpp.hpp>
#include <sensor_msgs/msg/joint_state.hpp>
#include <tf2_msgs/msg/tf_message.hpp>
#include <tf2_ros/buffer.h>
#include <moveit/robot_state/robot_state.h>
Include dependency graph for current_state_monitor.h:
This graph shows which files directly or indirectly include this file:

Go to the source code of this file.

Classes

class  planning_scene_monitor::CurrentStateMonitor
 Monitors the joint_states topic and tf to maintain the current state of the robot. More...
 
class  planning_scene_monitor::CurrentStateMonitor::MiddlewareHandle
 Dependency injection class for testing the CurrentStateMonitor. More...
 

Namespaces

 planning_scene_monitor
 

Typedefs

using planning_scene_monitor::JointStateUpdateCallback = std::function< void(sensor_msgs::msg::JointState::ConstSharedPtr)>
 

Functions

 planning_scene_monitor::MOVEIT_CLASS_FORWARD (CurrentStateMonitor)