#include "../../include/yocs_math_toolkit/common.hpp"
#include "../../include/yocs_math_toolkit/geometry.hpp"
Go to the source code of this file.
Namespaces | |
mtk | |
Functions | |
ECL_DEPRECATED const char * | mtk::point2str (const geometry_msgs::Point &point) |
std::string | mtk::point2str2D (const geometry_msgs::Point &point) |
std::string | mtk::point2str2D (const geometry_msgs::PointStamped &point) |
std::string | mtk::point2str3D (const geometry_msgs::Point &point) |
std::string | mtk::point2str3D (const geometry_msgs::PointStamped &point) |
ECL_DEPRECATED const char * | mtk::pose2str (const geometry_msgs::Pose &pose) |
ECL_DEPRECATED const char * | mtk::pose2str (const geometry_msgs::PoseStamped &pose) |
std::string | mtk::pose2str2D (const geometry_msgs::Pose &pose) |
std::string | mtk::pose2str2D (const geometry_msgs::PoseStamped &pose) |
std::string | mtk::pose2str3D (const geometry_msgs::Pose &pose) |
std::string | mtk::pose2str3D (const geometry_msgs::PoseStamped &pose) |
void | mtk::pose2tf (const geometry_msgs::Pose &pose, tf::Transform &tf) |
void | mtk::pose2tf (const geometry_msgs::PoseStamped &pose, tf::StampedTransform &tf) |
void | mtk::tf2pose (const tf::Transform &tf, geometry_msgs::Pose &pose) |
void | mtk::tf2pose (const tf::StampedTransform &tf, geometry_msgs::PoseStamped &pose) |
std::string | mtk::vector2str3D (const geometry_msgs::Vector3 &vector) |
std::string | mtk::vector2str3D (const geometry_msgs::Vector3Stamped &vector) |
Variables | |
char | mtk::___buffer___ [256] |