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__ |
def pymavlink.rotmat.Matrix3.__init__ | ( | self, | |
a = None , |
|||
b = None , |
|||
c = None |
|||
) |
def pymavlink.rotmat.Matrix3.__add__ | ( | self, | |
m | |||
) |
def pymavlink.rotmat.Matrix3.__copy__ | ( | self | ) |
def pymavlink.rotmat.Matrix3.__div__ | ( | self, | |
v | |||
) |
def pymavlink.rotmat.Matrix3.__mul__ | ( | self, | |
other | |||
) |
def pymavlink.rotmat.Matrix3.__neg__ | ( | self | ) |
def pymavlink.rotmat.Matrix3.__repr__ | ( | self | ) |
def pymavlink.rotmat.Matrix3.__rsub__ | ( | self, | |
m | |||
) |
def pymavlink.rotmat.Matrix3.__sub__ | ( | self, | |
m | |||
) |
def pymavlink.rotmat.Matrix3.close | ( | self, | |
m, | |||
tol = 1e-7 |
|||
) |
def pymavlink.rotmat.Matrix3.from_axis_angle | ( | self, | |
axis, | |||
angle | |||
) |
def pymavlink.rotmat.Matrix3.from_euler | ( | self, | |
roll, | |||
pitch, | |||
yaw | |||
) |
def pymavlink.rotmat.Matrix3.from_euler312 | ( | self, | |
roll, | |||
pitch, | |||
yaw | |||
) |
def pymavlink.rotmat.Matrix3.from_two_vectors | ( | self, | |
vec1, | |||
vec2 | |||
) |
def pymavlink.rotmat.Matrix3.identity | ( | self | ) |
def pymavlink.rotmat.Matrix3.normalize | ( | self | ) |
def pymavlink.rotmat.Matrix3.rotate | ( | self, | |
g | |||
) |
def pymavlink.rotmat.Matrix3.to_euler | ( | self | ) |
def pymavlink.rotmat.Matrix3.to_euler312 | ( | self | ) |
def pymavlink.rotmat.Matrix3.trace | ( | self | ) |
def pymavlink.rotmat.Matrix3.transposed | ( | self | ) |
pymavlink::rotmat.Matrix3::__radd__ = __add__ [static, private] |
pymavlink::rotmat.Matrix3::copy = __copy__ [static] |