Functions | Variables
pymavlink.tools.sertotcp Namespace Reference

Functions

def open_socket ()
 

Variables

 args = parser.parse_args()
 
 b = serport.read(n)
 
 default
 
bool gotdata = False
 
 help
 
 int
 
 n = serport.inWaiting()
 
 parser = ArgumentParser(description=__doc__)
 
 serport = serial.Serial(args.serialport, args.baudrate, timeout=0)
 
 str
 
 tcpsock = None
 
 type
 

Detailed Description

map a serial port to an outgoing TCP connection
Released under GNU GPLv3 or later

Function Documentation

◆ open_socket()

def pymavlink.tools.sertotcp.open_socket ( )

Definition at line 27 of file sertotcp.py.

Variable Documentation

◆ args

pymavlink.tools.sertotcp.args = parser.parse_args()

Definition at line 20 of file sertotcp.py.

◆ b

pymavlink.tools.sertotcp.b = serport.read(n)

Definition at line 49 of file sertotcp.py.

◆ default

pymavlink.tools.sertotcp.default

Definition at line 16 of file sertotcp.py.

◆ gotdata

bool pymavlink.tools.sertotcp.gotdata = False

Definition at line 40 of file sertotcp.py.

◆ help

pymavlink.tools.sertotcp.help

Definition at line 16 of file sertotcp.py.

◆ int

pymavlink.tools.sertotcp.int

Definition at line 16 of file sertotcp.py.

◆ n

pymavlink.tools.sertotcp.n = serport.inWaiting()

Definition at line 47 of file sertotcp.py.

◆ parser

pymavlink.tools.sertotcp.parser = ArgumentParser(description=__doc__)

Definition at line 15 of file sertotcp.py.

◆ serport

pymavlink.tools.sertotcp.serport = serial.Serial(args.serialport, args.baudrate, timeout=0)

Definition at line 22 of file sertotcp.py.

◆ str

pymavlink.tools.sertotcp.str

Definition at line 17 of file sertotcp.py.

◆ tcpsock

pymavlink.tools.sertotcp.tcpsock = None

Definition at line 24 of file sertotcp.py.

◆ type

pymavlink.tools.sertotcp.type

Definition at line 16 of file sertotcp.py.



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