Variables
pymavlink.examples.mavtcpsniff Namespace Reference

Variables

 args = parser.parse_args()
 
 l = msrc.recv_match();
 
int l_last_timestamp = 0
 
 l_timestamp = getattr(l, '_timestamp', None)
 
 logfile_raw
 
 mdst
 
 msrc
 
 parser = ArgumentParser(description=__doc__)
 
 r = mdst.recv_match();
 
int r_last_timestamp = 0
 
 r_timestamp = getattr(r, '_timestamp', None)
 
 type
 

Detailed Description

connect as a client to two tcpip ports on localhost with mavlink packets.    pass them both directions, and show packets in human-readable format on-screen.

this is useful if
* you have two SITL instances you want to connect to each other and see the comms.
* you have any tcpip based mavlink happening, and want something better than tcpdump

hint:
* you can use netcat/nc to do interesting redorection things with each end if you want to.

Copyright Sept 2012 David "Buzz" Bussenschutt
Released under GNU GPL version 3 or later

Variable Documentation

◆ args

pymavlink.examples.mavtcpsniff.args = parser.parse_args()

Definition at line 28 of file mavtcpsniff.py.

◆ l

pymavlink.examples.mavtcpsniff.l = msrc.recv_match();

Definition at line 61 of file mavtcpsniff.py.

◆ l_last_timestamp

pymavlink.examples.mavtcpsniff.l_last_timestamp = 0

Definition at line 63 of file mavtcpsniff.py.

◆ l_timestamp

int pymavlink.examples.mavtcpsniff.l_timestamp = getattr(l, '_timestamp', None)

Definition at line 65 of file mavtcpsniff.py.

◆ logfile_raw

pymavlink.examples.mavtcpsniff.logfile_raw

Definition at line 56 of file mavtcpsniff.py.

◆ mdst

pymavlink.examples.mavtcpsniff.mdst
Initial value:
1 = mavutil.mavlink_connection('tcp:localhost:{}'.format(args.dstport), planner_format=False,
2  notimestamps=True,
3  robust_parsing=True)

Definition at line 34 of file mavtcpsniff.py.

◆ msrc

pymavlink.examples.mavtcpsniff.msrc
Initial value:
1 = mavutil.mavlink_connection('tcp:localhost:{}'.format(args.srcport), planner_format=False,
2  notimestamps=True,
3  robust_parsing=True)

Definition at line 30 of file mavtcpsniff.py.

◆ parser

pymavlink.examples.mavtcpsniff.parser = ArgumentParser(description=__doc__)

Definition at line 24 of file mavtcpsniff.py.

◆ r

pymavlink.examples.mavtcpsniff.r = mdst.recv_match();

Definition at line 76 of file mavtcpsniff.py.

◆ r_last_timestamp

pymavlink.examples.mavtcpsniff.r_last_timestamp = 0

Definition at line 78 of file mavtcpsniff.py.

◆ r_timestamp

int pymavlink.examples.mavtcpsniff.r_timestamp = getattr(r, '_timestamp', None)

Definition at line 80 of file mavtcpsniff.py.

◆ type

pymavlink.examples.mavtcpsniff.type

Definition at line 25 of file mavtcpsniff.py.



mavlink
Author(s): Lorenz Meier
autogenerated on Fri Aug 2 2019 03:39:47