Namespaces | Functions
conversions.hpp File Reference
#include <Eigen/Dense>
#include <geometry_msgs/Quaternion.h>
Include dependency graph for conversions.hpp:

Go to the source code of this file.

Namespaces

namespace  labust
namespace  labust::tools

Functions

template<class Point , class Iterator >
void labust::tools::disableAxisToVector (Point &point, const Iterator &vec)
template<class T >
void labust::tools::eulerZYXFromQuaternion (const T &q, double &roll, double &pitch, double &yaw)
template<class T , class V >
void labust::tools::eulerZYXFromQuaternion (const T &q, V &vect)
void labust::tools::eulerZYXFromQuaternion (const geometry_msgs::Quaternion &q, double &roll, double &pitch, double &yaw)
template<class Point , class Iterator >
void labust::tools::nedToVector (const Point &point, Iterator &vec, int offset=0)
template<class Point , class Iterator >
void labust::tools::pointToVector (const Point &point, Iterator &vec, int offset=0)
template<class T >
void labust::tools::quaternionFromEulerZYX (double roll, double pitch, double yaw, Eigen::Quaternion< T > &q)
template<class T >
void labust::tools::quaternionFromEulerZYX (double roll, double pitch, double yaw, T &q)
template<class Point , class Iterator >
void labust::tools::rpyToVector (const Point &point, Iterator &vec, int offset=0)
template<class Point , class Iterator >
void labust::tools::vectorToDisableAxis (const Iterator &vec, Point &point)
template<class Point , class Iterator >
void labust::tools::vectorToNED (const Iterator &vec, Point &point, int offset=0)
template<class Point , class Iterator >
void labust::tools::vectorToPoint (const Iterator &vec, Point &point, int offset=0)
template<class Point , class Iterator >
void labust::tools::vectorToRPY (const Iterator &vec, Point &point, int offset=0)


snippets
Author(s): Gyula Nagy
autogenerated on Fri Aug 28 2015 11:22:33