Namespace tf2
Detailed Description
This file contains conversion functions from standard ROS message types to/from the 2D geometry objects. These are designed to work with the Namespace tf2 data conversion system: http://wiki.ros.org/tf2/Tutorials/Migration/DataConversions
Functions
Function tf2::fromMsg(const geometry_msgs::msg::Pose&, tf2_2d::Transform&)
Function tf2::fromMsg(const geometry_msgs::msg::Pose2D&, tf2_2d::Transform&)
Function tf2::fromMsg(const geometry_msgs::msg::TransformStamped&, tf2::Stamped<tf2_2d::Transform>&)
Function tf2::fromMsg(const geometry_msgs::msg::PoseStamped&, tf2::Stamped<tf2_2d::Transform>&)
Function tf2::fromMsg(const geometry_msgs::msg::QuaternionStamped&, tf2::Stamped<tf2_2d::Rotation>&)
Function tf2::fromMsg(const geometry_msgs::msg::Vector3&, tf2_2d::Vector2&)
Function tf2::fromMsg(const geometry_msgs::msg::Point&, tf2_2d::Vector2&)
Function tf2::fromMsg(const geometry_msgs::msg::Point32&, tf2_2d::Vector2&)
Function tf2::fromMsg(const geometry_msgs::msg::Vector3Stamped&, tf2::Stamped<tf2_2d::Vector2>&)
Function tf2::fromMsg(const geometry_msgs::msg::PointStamped&, tf2::Stamped<tf2_2d::Vector2>&)
Function tf2::fromMsg(const geometry_msgs::msg::Quaternion&, tf2_2d::Rotation&)
Function tf2::fromMsg(const geometry_msgs::msg::Transform&, tf2_2d::Transform&)
Function tf2::toMsg(const tf2::Stamped<tf2_2d::Transform>&, geometry_msgs::msg::TransformStamped&)
Function tf2::toMsg(const tf2::Stamped<tf2_2d::Transform>&, geometry_msgs::msg::PoseStamped&)
Function tf2::toMsg(const tf2_2d::Vector2&, geometry_msgs::msg::Vector3&)
Function tf2::toMsg(const tf2_2d::Vector2&, geometry_msgs::msg::Point&)
Function tf2::toMsg(const tf2_2d::Transform&, geometry_msgs::msg::Pose&)
Function tf2::toMsg(const tf2_2d::Vector2&, geometry_msgs::msg::Point32&)
Function tf2::toMsg(const tf2::Stamped<tf2_2d::Vector2>&, geometry_msgs::msg::Vector3Stamped&)
Function tf2::toMsg(const tf2::Stamped<tf2_2d::Vector2>&, geometry_msgs::msg::PointStamped&)
Function tf2::toMsg(const tf2_2d::Rotation&, geometry_msgs::msg::Quaternion&)
Function tf2::toMsg(const tf2::Stamped<tf2_2d::Rotation>&, geometry_msgs::msg::QuaternionStamped&)
Function tf2::toMsg(const tf2_2d::Transform&, geometry_msgs::msg::Transform&)
Function tf2::toMsg(const tf2_2d::Transform&, geometry_msgs::msg::Pose2D&)
Function tf2::transformCovariance(const Eigen::Matrix3d&, const tf2_2d::Transform&)
Function tf2::transformCovariance(const std::array<double, 9>&, const tf2_2d::Transform&)
Function tf2::transformCovariance(const boost::array<double, 9>&, const tf2_2d::Transform&)