Classes | |
class | Rotation |
Functions | |
def | add_errors |
def | mag_fixup |
def | magfit |
Variables | |
tuple | args = parser.parse_args() |
tuple | parser = ArgumentParser(description=__doc__) |
list | rotations |
def pymavlink.tools.magfit_rotation_gyro.add_errors | ( | mag, | |
gyr, | |||
last_mag, | |||
deltat, | |||
total_error, | |||
rotations | |||
) |
Definition at line 90 of file magfit_rotation_gyro.py.
def pymavlink.tools.magfit_rotation_gyro.mag_fixup | ( | mag, | |
AHRS_ORIENTATION, | |||
COMPASS_ORIENT, | |||
COMPASS_EXTERNAL | |||
) |
fixup a mag vector back to original value using AHRS and Compass orientation parameters
Definition at line 80 of file magfit_rotation_gyro.py.
def pymavlink.tools.magfit_rotation_gyro.magfit | ( | logfile | ) |
find best magnetometer rotation fit to a log file
Definition at line 104 of file magfit_rotation_gyro.py.
tuple pymavlink::tools::magfit_rotation_gyro::args = parser.parse_args() |
Definition at line 16 of file magfit_rotation_gyro.py.
tuple pymavlink::tools::magfit_rotation_gyro::parser = ArgumentParser(description=__doc__) |
Definition at line 10 of file magfit_rotation_gyro.py.
Definition at line 39 of file magfit_rotation_gyro.py.