Main Page
Namespaces
Classes
Files
File List
File Members
pymavlink
tools
python_array_test_recv.py
Go to the documentation of this file.
1
#!/usr/bin/env python
2
# -*- coding: utf-8 -*-
3
4
from
__future__
import
print_function
5
from
pymavlink
import
mavutil
6
7
master = mavutil.mavlink_connection(
"udp::14555"
, dialect=
"array_test"
)
8
9
while
True
:
10
m = master.recv_msg()
11
if
m
is
not
None
:
12
print(m)
mavlink
Author(s): Lorenz Meier
autogenerated on Sun Apr 7 2019 02:06:02