Classes | |
class | Rotation |
Functions | |
def | add_errors |
def | angle_diff |
def | generate_rotations |
def | heading_difference |
def | in_rotations_list |
def | magfit |
Variables | |
tuple | args = parser.parse_args() |
tuple | parser = ArgumentParser(description=__doc__) |
def pymavlink.tools.magfit_rotation_gps.add_errors | ( | mag, | |
attitude, | |||
total_error, | |||
rotations | |||
) |
Definition at line 70 of file magfit_rotation_gps.py.
def pymavlink.tools.magfit_rotation_gps.angle_diff | ( | angle1, | |
angle2 | |||
) |
give the difference between two angles in degrees
Definition at line 52 of file magfit_rotation_gps.py.
generate all 90 degree rotations
Definition at line 40 of file magfit_rotation_gps.py.
def pymavlink.tools.magfit_rotation_gps.heading_difference | ( | mag, | |
attitude, | |||
declination | |||
) |
Definition at line 61 of file magfit_rotation_gps.py.
def pymavlink.tools.magfit_rotation_gps.in_rotations_list | ( | rotations, | |
m | |||
) |
Definition at line 30 of file magfit_rotation_gps.py.
def pymavlink.tools.magfit_rotation_gps.magfit | ( | logfile | ) |
find best magnetometer rotation fit to a log file
Definition at line 77 of file magfit_rotation_gps.py.
tuple pymavlink::tools::magfit_rotation_gps::args = parser.parse_args() |
Definition at line 16 of file magfit_rotation_gps.py.
tuple pymavlink::tools::magfit_rotation_gps::parser = ArgumentParser(description=__doc__) |
Definition at line 10 of file magfit_rotation_gps.py.