Go to the documentation of this file.00001
00002
00003
00004 from pymavlink import mavutil
00005
00006 master = mavutil.mavlink_connection("udp::14555", dialect="array_test")
00007
00008 while True:
00009 m = master.recv_msg()
00010 if m is not None:
00011 print(m)