|
void | fromMsg (const geometry_msgs::Point &msg, Eigen::Vector3d &out) |
|
void | fromMsg (const geometry_msgs::Pose &msg, Eigen::Affine3d &out) |
|
void | fromMsg (const geometry_msgs::Pose &msg, Eigen::Isometry3d &out) |
|
void | fromMsg (const geometry_msgs::Quaternion &msg, Eigen::Quaterniond &out) |
|
void | fromMsg (const geometry_msgs::Twist &msg, Eigen::Matrix< double, 6, 1 > &out) |
|
geometry_msgs::Pose | toMsg (const Eigen::Affine3d &in) |
|
geometry_msgs::Pose | toMsg (const Eigen::Isometry3d &in) |
|
geometry_msgs::Point | toMsg (const Eigen::Vector3d &in) |
|
geometry_msgs::Quaternion | toMsg (const Eigen::Quaterniond &in) |
|
geometry_msgs::Twist | toMsg (const Eigen::Matrix< double, 6, 1 > &in) |
|