Variables | |
m = master.recv_msg() | |
master = mavutil.mavlink_connection("udp::14555", dialect="array_test") | |
pymavlink.tools.python_array_test_recv.m = master.recv_msg() |
Definition at line 10 of file python_array_test_recv.py.
pymavlink.tools.python_array_test_recv.master = mavutil.mavlink_connection("udp::14555", dialect="array_test") |
Definition at line 7 of file python_array_test_recv.py.