Position and orientation information with respect to a given coordinate frame. More...
#include "Orientation.h"#include "Position.h"#include <geometry_msgs/Pose.h>#include <geometry_msgs/PoseStamped.h>#include <geometry_msgs/PoseWithCovariance.h>#include <geometry_msgs/PoseWithCovarianceStamped.h>#include <geometry_msgs/Transform.h>#include <geometry_msgs/TransformStamped.h>#include <tf2/LinearMath/Transform.h>#include <string>

Go to the source code of this file.
| Classes | |
| class | rail::pick_and_place::graspdb::Pose | 
| Position and orientation information with respect to a given coordinate frame.  More... | |
| Namespaces | |
| namespace | rail | 
| namespace | rail::pick_and_place | 
| namespace | rail::pick_and_place::graspdb | 
Position and orientation information with respect to a given coordinate frame.
A pose contains position and orientation information as well as a coordinate frame identifier. This coordinate frame should be a fixed frame on the robot. This class is useful for internal data management within the graspdb library. Convenience functions are added for use with ROS messages.
Definition in file Pose.h.