$search
#include <eigen_conversions/eigen_msg.h>
Go to the source code of this file.
Namespaces | |
namespace | tf |
Functions | |
void | tf::poseEigenToMsg (const Eigen::Affine3d &e, geometry_msgs::Pose &m) |
Converts an Eigen transform into a Pose message. | |
void | tf::poseMsgToEigen (const geometry_msgs::Pose &m, Eigen::Affine3d &e) |
Converts a Pose message into an Eigen Transform. | |
void | tf::twistEigenToMsg (const Eigen::Matrix< double, 6, 1 > &e, geometry_msgs::Twist &m) |
Converts an Eigen matrix into a Twist message. | |
void | tf::twistMsgToEigen (const geometry_msgs::Twist &m, Eigen::Matrix< double, 6, 1 > &e) |
Converts a Twist message into an Eigen matrix. | |
void | tf::wrenchEigenToMsg (const Eigen::Matrix< double, 6, 1 > &e, geometry_msgs::Wrench &m) |
Converts an Eigen matrix into a Wrench message. | |
void | tf::wrenchMsgToEigen (const geometry_msgs::Wrench &m, Eigen::Matrix< double, 6, 1 > &e) |
Converts a Wrench message into an Eigen matrix. |