Function tf2::toMsg2
Defined in File tf2_eigen.hpp
Function Documentation
-
inline geometry_msgs::msg::Vector3 tf2::toMsg2(const Eigen::Vector3d &in)
Convert a Eigen::Vector3d type to a geometry_msgs::msg::Vector3. This function is a specialization of the toMsg template defined in tf2/convert.h. The function was renamed to toMsg2 to avoid overloading conflicts with definitions above.
- Parameters:
in – The Eigen::Vector3d to convert.
- Returns:
The Eigen::Vector3d converted to a geometry_msgs::msg::Vector3 message.