#include <moveit/robot_state/robot_state.h>
#include <moveit/transforms/transforms.h>
#include <moveit_msgs/RobotState.h>
#include <moveit_msgs/RobotTrajectory.h>
Go to the source code of this file.
Namespaces | |
namespace | robot_state |
This namespace includes the classes in the robot_state library. | |
Functions | |
bool | robot_state::jointStateToRobotState (const sensor_msgs::JointState &joint_state, RobotState &state) |
Convert a joint state to a kinematic state. | |
bool | robot_state::robotStateMsgToRobotState (const Transforms &tf, const moveit_msgs::RobotState &robot_state, RobotState &state, bool copy_attached_bodies=true) |
Convert a robot state (with accompanying extra transforms) to a kinematic state. | |
bool | robot_state::robotStateMsgToRobotState (const moveit_msgs::RobotState &robot_state, RobotState &state, bool copy_attached_bodies=true) |
Convert a robot state (with accompanying extra transforms) to a kinematic state. | |
void | robot_state::robotStateToJointStateMsg (const RobotState &state, sensor_msgs::JointState &joint_state) |
Convert a kinematic state to a joint state message. | |
void | robot_state::robotStateToRobotStateMsg (const RobotState &state, moveit_msgs::RobotState &robot_state, bool copy_attached_bodies=true) |
Convert a kinematic state to a robot state message. |