#include "pose_string.h"
#include <eigen_conversions/eigen_msg.h>
#include <iostream>
#include <iomanip>
Go to the source code of this file.
Functions | |
std::string | PoseString (const geometry_msgs::Pose &pose) |
std::string | PoseString (const Eigen::Affine3d &pose) |
std::string PoseString | ( | const geometry_msgs::Pose & | pose | ) |
return a string describing a pose (position and quaternion)
Definition at line 50 of file pose_string.cpp.
std::string PoseString | ( | const Eigen::Affine3d & | pose | ) |
return a string describing a pose Assumes the pose is a rotation and a translation
Definition at line 70 of file pose_string.cpp.