#include <ros/ros.h>
#include <tf/tf.h>
#include <moveit/robot_state/robot_state.h>
#include <sensor_msgs/JointState.h>
#include <boost/function.hpp>
#include <boost/shared_ptr.hpp>
#include <boost/thread/mutex.hpp>
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... | |
Namespaces | |
namespace | planning_scene_monitor |
Typedefs | |
typedef boost::function< void(const sensor_msgs::JointStateConstPtr &joint_state)> | planning_scene_monitor::JointStateUpdateCallback |
Functions | |
planning_scene_monitor::MOVEIT_CLASS_FORWARD (CurrentStateMonitor) |