#include <tf2_geometry_msgs/tf2_geometry_msgs.h>
#include <tf2/transform_datatypes.h>
#include <tf2/LinearMath/Quaternion.h>
Go to the source code of this file.
Namespaces | |
tf2 | |
tf2::impl | |
Functions | |
void | tf2::impl::getEulerYPR (const tf2::Quaternion &q, double &yaw, double &pitch, double &roll) |
double | tf2::impl::getYaw (const tf2::Quaternion &q) |
tf2::Quaternion | tf2::impl::toQuaternion (const tf2::Quaternion &q) |
tf2::Quaternion | tf2::impl::toQuaternion (const geometry_msgs::Quaternion &q) |
tf2::Quaternion | tf2::impl::toQuaternion (const geometry_msgs::QuaternionStamped &q) |
template<typename T > | |
tf2::Quaternion | tf2::impl::toQuaternion (const tf2::Stamped< T > &t) |
template<typename T > | |
tf2::Quaternion | tf2::impl::toQuaternion (const T &t) |