Public Member Functions | |
def | __add__ |
def | __copy__ |
def | __div__ |
def | __eq__ |
def | __init__ |
def | __mod__ |
def | __mul__ |
def | __ne__ |
def | __neg__ |
def | __repr__ |
def | __rsub__ |
def | __sub__ |
def | angle |
def | close |
def | length |
def | normalize |
def | normalized |
def | zero |
Public Attributes | |
x | |
y | |
z | |
Static Public Attributes | |
copy = __copy__ | |
Static Private Attributes | |
__radd__ = __add__ | |
__rmul__ = __mul__ |
def pymavlink.rotmat.Vector3.__init__ | ( | self, | |
x = None , |
|||
y = None , |
|||
z = None |
|||
) |
def pymavlink.rotmat.Vector3.__add__ | ( | self, | |
v | |||
) |
def pymavlink.rotmat.Vector3.__copy__ | ( | self | ) |
def pymavlink.rotmat.Vector3.__div__ | ( | self, | |
v | |||
) |
def pymavlink.rotmat.Vector3.__eq__ | ( | self, | |
v | |||
) |
def pymavlink.rotmat.Vector3.__mod__ | ( | self, | |
v | |||
) |
def pymavlink.rotmat.Vector3.__mul__ | ( | self, | |
v | |||
) |
def pymavlink.rotmat.Vector3.__ne__ | ( | self, | |
v | |||
) |
def pymavlink.rotmat.Vector3.__neg__ | ( | self | ) |
def pymavlink.rotmat.Vector3.__repr__ | ( | self | ) |
def pymavlink.rotmat.Vector3.__rsub__ | ( | self, | |
v | |||
) |
def pymavlink.rotmat.Vector3.__sub__ | ( | self, | |
v | |||
) |
def pymavlink.rotmat.Vector3.angle | ( | self, | |
v | |||
) |
def pymavlink.rotmat.Vector3.close | ( | self, | |
v, | |||
tol = 1e-7 |
|||
) |
def pymavlink.rotmat.Vector3.length | ( | self | ) |
def pymavlink.rotmat.Vector3.normalize | ( | self | ) |
def pymavlink.rotmat.Vector3.normalized | ( | self | ) |
def pymavlink.rotmat.Vector3.zero | ( | self | ) |
pymavlink::rotmat.Vector3::__radd__ = __add__ [static, private] |
pymavlink::rotmat.Vector3::__rmul__ = __mul__ [static, private] |
pymavlink::rotmat.Vector3::copy = __copy__ [static] |