Position and orientation information. More...
#include "Orientation.h"
#include "Position.h"
#include <geometry_msgs/Pose.h>
#include <geometry_msgs/Transform.h>
#include <tf2/LinearMath/Transform.h>
Go to the source code of this file.
Classes | |
class | rail::spatial_temporal_learning::worldlib::geometry::Pose |
Position and orientation information. More... | |
Namespaces | |
namespace | rail |
namespace | rail::spatial_temporal_learning |
namespace | rail::spatial_temporal_learning::worldlib |
namespace | rail::spatial_temporal_learning::worldlib::geometry |
Position and orientation information.
A pose contains position and orientation information. This class is useful for internal data management within the worldlib library. Convenience functions are added for use with ROS messages.
Definition in file Pose.h.