#include <geometry_msgs/TransformStamped.h>#include <geometry_msgs/Pose.h>#include <Eigen/Geometry>#include <boost/shared_ptr.hpp>#include <boost/noncopyable.hpp>#include <moveit/macros/class_forward.h>

Go to the source code of this file.
Classes | |
| class | robot_state::Transforms |
| Provides an implementation of a snapshot of a transform tree that can be easily queried for transforming different quantities. Transforms are maintained as a list of transforms to a particular frame. All stored transforms are considered fixed. More... | |
Namespaces | |
| namespace | robot_state |
This namespace includes the classes in the robot_state library. | |
Typedefs | |
| typedef std::map< std::string, Eigen::Affine3d, std::less < std::string > , Eigen::aligned_allocator < std::pair< const std::string, Eigen::Affine3d > > > | robot_state::FixedTransformsMap |
| Map frame names to the transformation matrix that can transform objects from the frame name to the planning frame. | |
Functions | |
| robot_state::MOVEIT_CLASS_FORWARD (Transforms) | |