tf2_2d
1.2
C++ API
Class Hierarchy
File Hierarchy
Full C++ API
Namespaces
Namespace tf2
Namespace tf2_2d
Classes and Structs
Class Rotation
Class Transform
Class Vector2
Functions
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::QuaternionStamped&, tf2::Stamped<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::Vector2&, geometry_msgs::msg::Point32&)
Function tf2::toMsg(const tf2_2d::Vector2&)
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::Stamped<tf2_2d::Vector2>&)
Function tf2::toMsg(const tf2_2d::Rotation&, geometry_msgs::msg::Quaternion&)
Function tf2::toMsg(const tf2_2d::Rotation&)
Function tf2::toMsg(const tf2::Stamped<tf2_2d::Rotation>&, geometry_msgs::msg::QuaternionStamped&)
Function tf2::toMsg(const tf2::Stamped<tf2_2d::Rotation>&)
Function tf2::toMsg(const tf2_2d::Transform&, geometry_msgs::msg::Transform&)
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_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::Stamped<tf2_2d::Transform>&)
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&)
Function tf2_2d::operator*(Rotation, const tf2Scalar)
Function tf2_2d::operator*(const tf2Scalar, Rotation)
Function tf2_2d::operator*(const Rotation&, const Vector2&)
Function tf2_2d::operator*(Transform, const Transform&)
Function tf2_2d::operator*(const Transform&, const Vector2&)
Function tf2_2d::operator*(const Transform&, const Rotation&)
Function tf2_2d::operator*(Vector2, const tf2Scalar)
Function tf2_2d::operator*(const tf2Scalar, Vector2)
Function tf2_2d::operator*(Vector2, const Vector2&)
Function tf2_2d::operator+(Rotation, const Rotation&)
Function tf2_2d::operator+(Vector2, const Vector2&)
Function tf2_2d::operator-(Rotation, const Rotation&)
Function tf2_2d::operator-(Vector2, const Vector2&)
Function tf2_2d::operator/(Rotation, const tf2Scalar)
Function tf2_2d::operator/(Vector2, const tf2Scalar)
Function tf2_2d::operator/(Vector2, const Vector2&)
Function tf2_2d::operator<<(std::ostream&, const Rotation&)
Function tf2_2d::operator<<(std::ostream&, const Transform&)
Function tf2_2d::operator<<(std::ostream&, const Vector2&)
Directories
Directory include
Directory tf2_2d
Files
File rotation.h
File rotation.hpp
File rotation_impl.hpp
File tf2_2d.h
File tf2_2d.hpp
File transform.h
File transform.hpp
File transform_impl.hpp
File vector2.h
File vector2.hpp
File vector2_impl.hpp
Standard Documents
CHANGELOG
Changelog for package tf2_2d
1.2.0 (2024-09-16)
1.1.0 (2024-06-17)
1.0.1 (2023-03-03)
0.6.4 (2021-07-14)
0.6.3 (2021-07-13)
0.6.2 (2021-07-12)
0.6.1 (2021-07-11)
0.6.0 (2020-10-02)
0.5.0 (2019-07-12)
0.4.0 (2019-03-18)
0.3.0 (2019-01-16)
0.2.0 (2018-04-16)
0.1.0 (2018-02-14)
LICENSE
PACKAGE
README
tf2_2d
Using tf2 toMsg() and fromMsg()
Transformation math
Index
tf2_2d
C++ API
Function tf2_2d::operator*(const Transform&, const Vector2&)
View page source
Function tf2_2d::operator*(const Transform&, const Vector2&)
Defined in
File transform_impl.hpp
Function Documentation
inline
Vector2
tf2_2d
::
operator
*
(
const
Transform
&
lhs
,
const
Vector2
&
rhs
)
Return the transformed vector.
Output = This * Vector