Macros | Functions
include_v1.0/mavlink_conversions.h File Reference
#include <math.h>
Include dependency graph for include_v1.0/mavlink_conversions.h:
This graph shows which files directly or indirectly include this file:

Go to the source code of this file.

Macros

#define M_PI_2   ((float)asin(1))
 

Functions

MAVLINK_HELPER void mavlink_dcm_to_euler (const float dcm[3][3], float *roll, float *pitch, float *yaw)
 
MAVLINK_HELPER void mavlink_dcm_to_quaternion (const float dcm[3][3], float quaternion[4])
 
MAVLINK_HELPER void mavlink_euler_to_dcm (float roll, float pitch, float yaw, float dcm[3][3])
 
MAVLINK_HELPER void mavlink_euler_to_quaternion (float roll, float pitch, float yaw, float quaternion[4])
 
MAVLINK_HELPER void mavlink_quaternion_to_dcm (const float quaternion[4], float dcm[3][3])
 
MAVLINK_HELPER void mavlink_quaternion_to_euler (const float quaternion[4], float *roll, float *pitch, float *yaw)
 

Macro Definition Documentation

#define M_PI_2   ((float)asin(1))

Definition at line 15 of file include_v1.0/mavlink_conversions.h.

Function Documentation

MAVLINK_HELPER void mavlink_dcm_to_euler ( const float  dcm[3][3],
float *  roll,
float *  pitch,
float *  yaw 
)

Converts a rotation matrix to euler angles

Parameters
dcma 3x3 rotation matrix
rollthe roll angle in radians
pitchthe pitch angle in radians
yawthe yaw angle in radians

Definition at line 70 of file include_v1.0/mavlink_conversions.h.

MAVLINK_HELPER void mavlink_dcm_to_quaternion ( const float  dcm[3][3],
float  quaternion[4] 
)

Converts a rotation matrix to a quaternion Reference:

Parameters
dcma 3x3 rotation matrix
quaterniona [w, x, y, z] ordered quaternion (null-rotation being 1 0 0 0)

Definition at line 148 of file include_v1.0/mavlink_conversions.h.

MAVLINK_HELPER void mavlink_euler_to_dcm ( float  roll,
float  pitch,
float  yaw,
float  dcm[3][3] 
)

Converts euler angles to a rotation matrix

Parameters
rollthe roll angle in radians
pitchthe pitch angle in radians
yawthe yaw angle in radians
dcma 3x3 rotation matrix

Definition at line 191 of file include_v1.0/mavlink_conversions.h.

MAVLINK_HELPER void mavlink_euler_to_quaternion ( float  roll,
float  pitch,
float  yaw,
float  quaternion[4] 
)

Converts euler angles to a quaternion

Parameters
rollthe roll angle in radians
pitchthe pitch angle in radians
yawthe yaw angle in radians
quaterniona [w, x, y, z] ordered quaternion (null-rotation being 1 0 0 0)

Definition at line 120 of file include_v1.0/mavlink_conversions.h.

MAVLINK_HELPER void mavlink_quaternion_to_dcm ( const float  quaternion[4],
float  dcm[3][3] 
)

Converts a quaternion to a rotation matrix

Parameters
quaterniona [w, x, y, z] ordered quaternion (null-rotation being 1 0 0 0)
dcma 3x3 rotation matrix

Definition at line 40 of file include_v1.0/mavlink_conversions.h.

MAVLINK_HELPER void mavlink_quaternion_to_euler ( const float  quaternion[4],
float *  roll,
float *  pitch,
float *  yaw 
)

Converts a quaternion to euler angles

Parameters
quaterniona [w, x, y, z] ordered quaternion (null-rotation being 1 0 0 0)
rollthe roll angle in radians
pitchthe pitch angle in radians
yawthe yaw angle in radians

Definition at line 104 of file include_v1.0/mavlink_conversions.h.



mavlink
Author(s): Lorenz Meier
autogenerated on Sun Apr 7 2019 02:06:02