Functions | |
def | mav_to_gpx (infilename, outfilename) |
Variables | |
action | |
args = parser.parse_args() | |
default | |
False | |
help | |
metavar | |
nargs | |
None | |
string | outfilename = infilename+'.gpx' |
parser = ArgumentParser(description=__doc__) | |
example program to extract GPS data from a mavlink log, and create a GPX file, for loading into google earth
def pymavlink.tools.mavtogpx.mav_to_gpx | ( | infilename, | |
outfilename | |||
) |
convert a mavlink log file to a GPX file
Definition at line 21 of file mavtogpx.py.
pymavlink.tools.mavtogpx.action |
Definition at line 14 of file mavtogpx.py.
pymavlink.tools.mavtogpx.args = parser.parse_args() |
Definition at line 16 of file mavtogpx.py.
pymavlink.tools.mavtogpx.default |
Definition at line 13 of file mavtogpx.py.
pymavlink.tools.mavtogpx.False |
Definition at line 14 of file mavtogpx.py.
pymavlink.tools.mavtogpx.help |
Definition at line 13 of file mavtogpx.py.
pymavlink.tools.mavtogpx.metavar |
Definition at line 15 of file mavtogpx.py.
pymavlink.tools.mavtogpx.nargs |
Definition at line 15 of file mavtogpx.py.
pymavlink.tools.mavtogpx.None |
Definition at line 13 of file mavtogpx.py.
string pymavlink.tools.mavtogpx.outfilename = infilename+'.gpx' |
Definition at line 106 of file mavtogpx.py.
pymavlink.tools.mavtogpx.parser = ArgumentParser(description=__doc__) |
Definition at line 12 of file mavtogpx.py.