Public Member Functions | Public Attributes | Static Public Attributes | Static Private Attributes
pymavlink.rotmat.Matrix3 Class Reference

List of all members.

Public Member Functions

def __add__
def __copy__
def __div__
def __init__
def __mul__
def __neg__
def __repr__
def __rsub__
def __sub__
def close
def from_axis_angle
def from_euler
def from_euler312
def from_two_vectors
def identity
def normalize
def rotate
def to_euler
def to_euler312
def trace
def transposed

Public Attributes

 a
 b
 c

Static Public Attributes

 copy = __copy__

Static Private Attributes

 __radd__ = __add__

Detailed Description

a 3x3 matrix, intended as a rotation matrix

Definition at line 127 of file rotmat.py.


Constructor & Destructor Documentation

def pymavlink.rotmat.Matrix3.__init__ (   self,
  a = None,
  b = None,
  c = None 
)

Definition at line 129 of file rotmat.py.


Member Function Documentation

def pymavlink.rotmat.Matrix3.__add__ (   self,
  m 
)

Definition at line 220 of file rotmat.py.

Definition at line 257 of file rotmat.py.

def pymavlink.rotmat.Matrix3.__div__ (   self,
  v 
)

Definition at line 251 of file rotmat.py.

def pymavlink.rotmat.Matrix3.__mul__ (   self,
  other 
)

Definition at line 231 of file rotmat.py.

Definition at line 254 of file rotmat.py.

Definition at line 137 of file rotmat.py.

def pymavlink.rotmat.Matrix3.__rsub__ (   self,
  m 
)

Definition at line 228 of file rotmat.py.

def pymavlink.rotmat.Matrix3.__sub__ (   self,
  m 
)

Definition at line 225 of file rotmat.py.

def pymavlink.rotmat.Matrix3.close (   self,
  m,
  tol = 1e-7 
)

Definition at line 325 of file rotmat.py.

def pymavlink.rotmat.Matrix3.from_axis_angle (   self,
  axis,
  angle 
)
create a rotation matrix from axis and angle

Definition at line 295 of file rotmat.py.

def pymavlink.rotmat.Matrix3.from_euler (   self,
  roll,
  pitch,
  yaw 
)
fill the matrix from Euler angles in radians

Definition at line 154 of file rotmat.py.

def pymavlink.rotmat.Matrix3.from_euler312 (   self,
  roll,
  pitch,
  yaw 
)
fill the matrix from Euler angles in radians in 312 convention

Definition at line 201 of file rotmat.py.

def pymavlink.rotmat.Matrix3.from_two_vectors (   self,
  vec1,
  vec2 
)
get a rotation matrix from two vectors.
   This returns a rotation matrix which when applied to vec1
   will produce a vector pointing in the same direction as vec2

Definition at line 313 of file rotmat.py.

Definition at line 143 of file rotmat.py.

re-normalise a rotation matrix

Definition at line 281 of file rotmat.py.

def pymavlink.rotmat.Matrix3.rotate (   self,
  g 
)
rotate the matrix by a given amount on 3 axes

Definition at line 262 of file rotmat.py.

find Euler angles (321 convention) for the matrix

Definition at line 174 of file rotmat.py.

find Euler angles (312 convention) for the matrix.
See http://www.atacolorado.com/eulersequences.doc

Definition at line 187 of file rotmat.py.

the trace of the matrix

Definition at line 291 of file rotmat.py.

Definition at line 148 of file rotmat.py.


Member Data Documentation

Definition at line 223 of file rotmat.py.

Definition at line 129 of file rotmat.py.

Definition at line 129 of file rotmat.py.

Definition at line 129 of file rotmat.py.

Definition at line 260 of file rotmat.py.


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


mavlink
Author(s): Lorenz Meier
autogenerated on Thu Jun 6 2019 19:01:58