File tf2_2d.hpp
↰ Parent directory (include/tf2_2d)
Definition (include/tf2_2d/tf2_2d.hpp)
Includes
- Eigen/Core
- array
- boost/array.hpp
- cmath
- geometry_msgs/msg/point.hpp
- geometry_msgs/msg/point32.hpp
- geometry_msgs/msg/point_stamped.hpp
- geometry_msgs/msg/pose.hpp
- geometry_msgs/msg/pose2_d.hpp
- geometry_msgs/msg/pose_stamped.hpp
- geometry_msgs/msg/quaternion.hpp
- geometry_msgs/msg/quaternion_stamped.hpp
- geometry_msgs/msg/transform.hpp
- geometry_msgs/msg/transform_stamped.hpp
- geometry_msgs/msg/vector3.hpp
- geometry_msgs/msg/vector3_stamped.hpp
- tf2/convert.h
- tf2/transform_datatypes.h
- tf2/utils.h
- tf2_2d/rotation.hpp(File rotation.hpp)
- tf2_2d/transform.hpp(File transform.hpp)
- tf2_2d/vector2.hpp(File vector2.hpp)
- tf2_geometry_msgs/tf2_geometry_msgs.hpp
- tf2_ros/buffer_interface.h
Included By
Namespaces
Functions
- 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::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::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::Transform&) 
- 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::Pose&) 
- Function tf2::toMsg(const tf2_2d::Transform&, geometry_msgs::msg::Pose2D&) 
- 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::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&)