Classes | |
class | Rotation |
Functions | |
def | add_errors (mag, gyr, last_mag, deltat, total_error, rotations) |
def | mag_fixup (mag, AHRS_ORIENTATION, COMPASS_ORIENT, COMPASS_EXTERNAL) |
def | magfit (logfile) |
Variables | |
action | |
args = parser.parse_args() | |
default | |
dest | |
float | |
help | |
metavar | |
nargs | |
parser = ArgumentParser(description=__doc__) | |
list | rotations |
type | |
fit best estimate of magnetometer rotation to gyro data
def pymavlink.tools.magfit_rotation_gyro.add_errors | ( | mag, | |
gyr, | |||
last_mag, | |||
deltat, | |||
total_error, | |||
rotations | |||
) |
Definition at line 92 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 82 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 106 of file magfit_rotation_gyro.py.
pymavlink.tools.magfit_rotation_gyro.action |
Definition at line 13 of file magfit_rotation_gyro.py.
pymavlink.tools.magfit_rotation_gyro.args = parser.parse_args() |
Definition at line 18 of file magfit_rotation_gyro.py.
pymavlink.tools.magfit_rotation_gyro.default |
Definition at line 15 of file magfit_rotation_gyro.py.
pymavlink.tools.magfit_rotation_gyro.dest |
Definition at line 13 of file magfit_rotation_gyro.py.
pymavlink.tools.magfit_rotation_gyro.float |
Definition at line 15 of file magfit_rotation_gyro.py.
pymavlink.tools.magfit_rotation_gyro.help |
Definition at line 13 of file magfit_rotation_gyro.py.
pymavlink.tools.magfit_rotation_gyro.metavar |
Definition at line 16 of file magfit_rotation_gyro.py.
pymavlink.tools.magfit_rotation_gyro.nargs |
Definition at line 16 of file magfit_rotation_gyro.py.
pymavlink.tools.magfit_rotation_gyro.parser = ArgumentParser(description=__doc__) |
Definition at line 12 of file magfit_rotation_gyro.py.
list pymavlink.tools.magfit_rotation_gyro.rotations |
Definition at line 41 of file magfit_rotation_gyro.py.
pymavlink.tools.magfit_rotation_gyro.type |
Definition at line 15 of file magfit_rotation_gyro.py.