#include <moveit/robot_model/joint_model_group.h>
#include <moveit/robot_state/link_state.h>
#include <moveit/robot_state/joint_state.h>
#include <sensor_msgs/JointState.h>
#include <moveit_msgs/RobotTrajectory.h>
#include <geometry_msgs/Twist.h>
#include <boost/scoped_ptr.hpp>
#include <boost/function.hpp>
Go to the source code of this file.
Classes | |
class | robot_state::JointStateGroup |
The joint state corresponding to a group. More... | |
Namespaces | |
namespace | robot_state |
This namespace includes the classes in the robot_state library. | |
Typedefs | |
typedef boost::function< bool(const JointStateGroup *joint_state_group, Eigen::VectorXd &stvector) | robot_state::SecondaryTaskFn ) |
typedef boost::function< bool(JointStateGroup *joint_state_group, const std::vector< double > &joint_group_variable_values) | robot_state::StateValidityCallbackFn ) |