Functions | |
def | show_messages |
def | wait_heartbeat |
Variables | |
tuple | args = parser.parse_args() |
int | default = 255 |
string | help = "master port baud rate" |
tuple | master = mavutil.mavlink_connection(args.device, baud=args.baudrate) |
tuple | parser = ArgumentParser(description=__doc__) |
show incoming mavlink messages
Definition at line 30 of file apmsetrate.py.
wait for a heartbeat so we know the target system IDs
Definition at line 24 of file apmsetrate.py.
tuple pymavlink::examples::apmsetrate::args = parser.parse_args() |
Definition at line 20 of file apmsetrate.py.
int pymavlink::examples::apmsetrate::default = 255 |
Definition at line 17 of file apmsetrate.py.
string pymavlink::examples::apmsetrate::help = "master port baud rate" |
Definition at line 13 of file apmsetrate.py.
tuple pymavlink::examples::apmsetrate::master = mavutil.mavlink_connection(args.device, baud=args.baudrate) |
Definition at line 44 of file apmsetrate.py.
tuple pymavlink::examples::apmsetrate::parser = ArgumentParser(description=__doc__) |
Definition at line 10 of file apmsetrate.py.