Public Member Functions | |
def | __init__ (self, roll, pitch, yaw, timestamp) |
def | update (self, gyro, accel, timestamp) |
Public Attributes | |
accel | |
dcm | |
gyro | |
timestamp | |
PX4 DCM state object
Definition at line 832 of file mavextra.py.
def pymavlink.mavextra.PX4_State.__init__ | ( | self, | |
roll, | |||
pitch, | |||
yaw, | |||
timestamp | |||
) |
Definition at line 834 of file mavextra.py.
def pymavlink.mavextra.PX4_State.update | ( | self, | |
gyro, | |||
accel, | |||
timestamp | |||
) |
Definition at line 842 of file mavextra.py.
pymavlink.mavextra.PX4_State.accel |
Definition at line 838 of file mavextra.py.
pymavlink.mavextra.PX4_State.dcm |
Definition at line 835 of file mavextra.py.
pymavlink.mavextra.PX4_State.gyro |
Definition at line 837 of file mavextra.py.
pymavlink.mavextra.PX4_State.timestamp |
Definition at line 839 of file mavextra.py.