Show EOL distros:
Package Summary
tf2_eigen
- Maintainer status: maintained
- Maintainer: Koji Terada <terakoji AT gmail DOT com>
- Author: Koji Terada
- License: BSD
- Source: git https://github.com/ros/geometry2.git (branch: indigo-devel)
Package Summary
tf2_eigen
- Maintainer status: maintained
- Maintainer: Koji Terada <terakoji AT gmail DOT com>
- Author: Koji Terada
- License: BSD
- Source: git https://github.com/ros/geometry2.git (branch: indigo-devel)
Package Summary
tf2_eigen
- Maintainer status: maintained
- Maintainer: Koji Terada <terakoji AT gmail DOT com>
- Author: Koji Terada
- License: BSD
- Source: git https://github.com/ros/geometry2.git (branch: indigo-devel)
Package Summary
tf2_eigen
- Maintainer status: maintained
- Maintainer: Koji Terada <terakoji AT gmail DOT com>
- Author: Koji Terada
- License: BSD
- Source: git https://github.com/ros/geometry2.git (branch: indigo-devel)
Package Summary
tf2_eigen
- Maintainer status: maintained
- Maintainer: Koji Terada <terakoji AT gmail DOT com>
- Author: Koji Terada
- License: BSD
- Source: git https://github.com/jsk-ros-pkg/geometry2_python3.git (branch: melodic-devel)
Package Summary
tf2_eigen
- Maintainer status: maintained
- Maintainer: Koji Terada <terakoji AT gmail DOT com>
- Author: Koji Terada
- License: BSD
- Source: git https://github.com/ros/geometry2.git (branch: noetic-devel)
Contents
New in I
Documentation
This is a conversion package to convert tf2 data to eigen data structures. These functions are templated.
Supported datatypes
ROS message type |
library datatype |
Transform function |
tf2::Stamped<Eigen::Vector3d> |
doTransform(const tf2::Stamped<Eigen::Vector3d>& t_in, tf2::Stamped<Eigen::Vector3d>& t_out, const geometry_msgs::TransformStamped& transform) |
|
tf2::Stamped<Eigen::Quaterniond> |
doTransform(const tf2::Stamped<Eigen::Quaterniond>& t_in, tf2::Stamped<Eigen::Quaterniond>& t_out, const geometry_msgs::QuaternionStamped& transform) |
|
tf2::Stamped<Eigen::Isometry3d> |
doTransform(const tf2::Stamped<Eigen::Isometry3d>& t_in, tf2::Stamped<Eigen::Isometry3d>& t_out, const geometry_msgs::TransformStamped& transform) |
|
tf2::Stamped<Eigen::Affine3d> |
doTransform(const tf2::Stamped<Eigen::Affine3d>& t_in, tf2::Stamped<Eigen::Affine3d>& t_out, const geometry_msgs::TransformStamped& transform) |
|
tf2::Stamped<Eigen::Affine3d> |
doTransform(const tf2::Stamped<Eigen::Affine3d>& t_in, tf2::Stamped<Eigen::Affine3d>& t_out, const geometry_msgs::TransformStamped& transform) |
How to use
Please see the Code API documentation for use.