Functions | |
def | add_data |
def | plotit |
def | process_file |
Variables | |
tuple | args = parser.parse_args() |
list | axes = [] |
tuple | caps = set(re.findall(re_caps, f)) |
list | col = colors[:] |
list | colors = [ 'red', 'green', 'blue', 'orange', 'olive', 'black', 'grey', 'yellow', 'brown', 'darkcyan', 'cornflowerblue', 'darkmagenta', 'deeppink', 'darkred'] |
dictionary | colourmap |
tuple | edge_colour = (0.1, 0.1, 0.1) |
list | f = filenames[fi] |
list | field_types = [] |
list | fields = [] |
list | filenames = [] |
list | first_only = [] |
string | help = "Choose the plot background according to the active flight mode of the specified type, e.g. --flightmode=apm for ArduPilot or --flightmode=px4 for PX4 stack logs. Cannot be specified with --xaxis." |
highest_x = None | |
input = raw_input | |
list | lab = labels[fi*len(fields):(fi+1)*len(fields)] |
tuple | labels = args.labels.split(',') |
lowest_x = None | |
list | modes = [] |
tuple | msg_types = set() |
list | multiplier = [] |
tuple | parser = ArgumentParser(description=__doc__) |
tuple | re_caps = re.compile('[A-Z_][A-Z0-9_]+') |
timeshift = args.timeshift | |
list | x = [] |
list | y = [] |
def pymavlink.tools.mavgraph.add_data | ( | t, | |
msg, | |||
vars, | |||
flightmode | |||
) |
add some data
Definition at line 215 of file mavgraph.py.
def pymavlink.tools.mavgraph.plotit | ( | x, | |
y, | |||
fields, | |||
colors = [] |
|||
) |
plot a set of graphs using date for x axis
Definition at line 55 of file mavgraph.py.
def pymavlink.tools.mavgraph.process_file | ( | filename, | |
timeshift | |||
) |
process one file
Definition at line 244 of file mavgraph.py.
tuple pymavlink::tools::mavgraph::args = parser.parse_args() |
Definition at line 168 of file mavgraph.py.
list pymavlink::tools::mavgraph::axes = [] |
Definition at line 203 of file mavgraph.py.
tuple pymavlink::tools::mavgraph::caps = set(re.findall(re_caps, f)) |
Definition at line 207 of file mavgraph.py.
list pymavlink::tools::mavgraph::col = colors[:] |
Definition at line 289 of file mavgraph.py.
list pymavlink::tools::mavgraph::colors = [ 'red', 'green', 'blue', 'orange', 'olive', 'black', 'grey', 'yellow', 'brown', 'darkcyan', 'cornflowerblue', 'darkmagenta', 'deeppink', 'darkred'] |
Definition at line 197 of file mavgraph.py.
dictionary pymavlink::tools::mavgraph::colourmap |
00001 { 00002 'apm' : { 00003 'MANUAL' : (1.0, 0, 0), 00004 'AUTO' : ( 0, 1.0, 0), 00005 'LOITER' : ( 0, 0, 1.0), 00006 'FBWA' : (1.0, 0.5, 0), 00007 'RTL' : ( 1, 0, 0.5), 00008 'STABILIZE' : (0.5, 1.0, 0), 00009 'LAND' : ( 0, 1.0, 0.5), 00010 'STEERING' : (0.5, 0, 1.0), 00011 'HOLD' : ( 0, 0.5, 1.0), 00012 'ALT_HOLD' : (1.0, 0.5, 0.5), 00013 'CIRCLE' : (0.5, 1.0, 0.5), 00014 'POSITION' : (1.0, 0.0, 1.0), 00015 'GUIDED' : (0.5, 0.5, 1.0), 00016 'ACRO' : (1.0, 1.0, 0), 00017 'CRUISE' : ( 0, 1.0, 1.0) 00018 }, 00019 'px4' : { 00020 'MANUAL' : (1.0, 0, 0), 00021 'SEATBELT' : ( 0.5, 0.5, 0), 00022 'EASY' : ( 0, 1.0, 0), 00023 'AUTO' : ( 0, 0, 1.0), 00024 'UNKNOWN' : ( 1.0, 1.0, 1.0) 00025 } 00026 }
Definition at line 23 of file mavgraph.py.
tuple pymavlink::tools::mavgraph::edge_colour = (0.1, 0.1, 0.1) |
Definition at line 50 of file mavgraph.py.
list pymavlink::tools::mavgraph::f = filenames[fi] |
Definition at line 277 of file mavgraph.py.
list pymavlink::tools::mavgraph::field_types = [] |
Definition at line 195 of file mavgraph.py.
list pymavlink::tools::mavgraph::fields = [] |
Definition at line 187 of file mavgraph.py.
list pymavlink::tools::mavgraph::filenames = [] |
Definition at line 186 of file mavgraph.py.
list pymavlink::tools::mavgraph::first_only = [] |
Definition at line 204 of file mavgraph.py.
string pymavlink::tools::mavgraph::help = "Choose the plot background according to the active flight mode of the specified type, e.g. --flightmode=apm for ArduPilot or --flightmode=px4 for PX4 stack logs. Cannot be specified with --xaxis." |
Definition at line 163 of file mavgraph.py.
Definition at line 53 of file mavgraph.py.
pymavlink::tools::mavgraph::input = raw_input |
Definition at line 19 of file mavgraph.py.
Definition at line 285 of file mavgraph.py.
pymavlink::tools::mavgraph::labels = args.labels.split(',') |
Definition at line 266 of file mavgraph.py.
Definition at line 52 of file mavgraph.py.
list pymavlink::tools::mavgraph::modes = [] |
Definition at line 202 of file mavgraph.py.
tuple pymavlink::tools::mavgraph::msg_types = set() |
Definition at line 193 of file mavgraph.py.
list pymavlink::tools::mavgraph::multiplier = [] |
Definition at line 194 of file mavgraph.py.
tuple pymavlink::tools::mavgraph::parser = ArgumentParser(description=__doc__) |
Definition at line 149 of file mavgraph.py.
tuple pymavlink::tools::mavgraph::re_caps = re.compile('[A-Z_][A-Z0-9_]+') |
Definition at line 205 of file mavgraph.py.
int pymavlink::tools::mavgraph::timeshift = args.timeshift |
Definition at line 274 of file mavgraph.py.
list pymavlink::tools::mavgraph::x = [] |
Definition at line 200 of file mavgraph.py.
list pymavlink::tools::mavgraph::y = [] |
Definition at line 201 of file mavgraph.py.