15#ifndef TF2__IMPL__UTILS_HPP_
16#define TF2__IMPL__UTILS_HPP_
21#include <geometry_msgs/msg/quaternion.hpp>
22#include <geometry_msgs/msg/quaternion_stamped.hpp>
76 geometry_msgs::msg::QuaternionStamped>(
t);
104 const double pi_2 = 1.57079632679489661923;
118 if (
sarg <= -0.99999) {
122 }
else if (
sarg >= 0.99999) {
158 if (
sarg <= -0.99999) {
160 }
else if (
sarg >= 0.99999) {
The Quaternion implements quaternion to perform linear algebra rotations in combination with Matrix3x...
Definition Quaternion.hpp:30
The data type which will be cross compatable with geometry_msgs This is the tf2 datatype equivilant o...
Definition transform_datatypes.hpp:49
void getEulerYPR(const tf2::Quaternion &q, double &yaw, double &pitch, double &roll)
Definition utils.hpp:102
double getYaw(const tf2::Quaternion &q)
Definition utils.hpp:140
tf2::Quaternion toQuaternion(const tf2::Quaternion &q)
Definition utils.hpp:39
Definition buffer_core.hpp:58
B toMsg(const A &a)
Function that converts from one type to a ROS message type. It has to be implemented by each data typ...
void fromMsg(const A &a, B &b)
Function that converts from a ROS message type to another type. It has to be implemented by each data...