Public Member Functions | Public Attributes | Private Member Functions
pymavlink.tools.quaterniontest.QuaternionTest Class Reference
Inheritance diagram for pymavlink.tools.quaterniontest.QuaternionTest:
Inheritance graph
[legend]

List of all members.

Public Member Functions

def __init__
def test_constructor
def test_conversion
def test_mul
def test_transform

Public Attributes

 quaternions

Private Member Functions

def _all_quaternions
def _helper_test_constructor

Detailed Description

Class to test Quaternion

Definition at line 204 of file quaterniontest.py.


Constructor & Destructor Documentation

def pymavlink.tools.quaterniontest.QuaternionTest.__init__ (   self,
  args,
  kwargs 
)
Constructor, set up some data that is reused in many tests

Reimplemented from pymavlink.tools.quaterniontest.QuaternionBaseTest.

Definition at line 209 of file quaterniontest.py.


Member Function Documentation

Generate quaternions from all euler angles

Reimplemented from pymavlink.tools.quaterniontest.QuaternionBaseTest.

Definition at line 214 of file quaterniontest.py.

def pymavlink.tools.quaterniontest.QuaternionTest._helper_test_constructor (   self,
  q,
  euler,
  dcm 
) [private]
Helper function for constructor test

Calls constructor for the quaternion from q euler and dcm and checks
if the resulting converions are equivalent to the arguments.
The test for the euler angles is weak as the solution is not unique

:param q: quaternion 4x1, [w, x, y, z]
:param euler: Vector3(roll, pitch, yaw), needs to be equivalent to q
:param q: Matrix3, needs to be equivalent to q

Reimplemented from pymavlink.tools.quaterniontest.QuaternionBaseTest.

Definition at line 237 of file quaterniontest.py.

Test the constructor functionality

Reimplemented from pymavlink.tools.quaterniontest.QuaternionBaseTest.

Definition at line 218 of file quaterniontest.py.

Tests forward and backward conversions

Reimplemented from pymavlink.tools.quaterniontest.QuaternionBaseTest.

Definition at line 301 of file quaterniontest.py.

Test multiplication

Reimplemented from pymavlink.tools.quaterniontest.QuaternionBaseTest.

Definition at line 329 of file quaterniontest.py.

Test transform

Reimplemented from pymavlink.tools.quaterniontest.QuaternionBaseTest.

Definition at line 318 of file quaterniontest.py.


Member Data Documentation

Reimplemented from pymavlink.tools.quaterniontest.QuaternionBaseTest.

Definition at line 209 of file quaterniontest.py.


The documentation for this class was generated from the following file:


mavlink
Author(s): Lorenz Meier
autogenerated on Sun May 22 2016 04:05:44