Functions | Variables
pymavlink.generator.mavgen_cs Namespace Reference

Functions

def generate (basename, xml)
 
def generate_classes (outf, msgs)
 
def generate_CodecIndex (outf, messages, xml)
 
def generate_Deserialization (outf, messages)
 
def generate_enums (outf, enums)
 
def generate_preamble (outf, msgs, args, xml)
 
def generate_Serialization (outf, messages)
 
def generate_xmlDocSummary (outf, summaryText, tabDepth)
 

Variables

dictionary map
 
dictionary mapFieldName
 
dictionary mapType
 
 t = mavtemplate.MAVTemplate()
 

Detailed Description

parse a MAVLink protocol XML file and generate a CSharp implementation

Function Documentation

def pymavlink.generator.mavgen_cs.generate (   basename,
  xml 
)
generate complete MAVLink CSharp implemenation

Definition at line 258 of file mavgen_cs.py.

def pymavlink.generator.mavgen_cs.generate_classes (   outf,
  msgs 
)

Definition at line 90 of file mavgen_cs.py.

def pymavlink.generator.mavgen_cs.generate_CodecIndex (   outf,
  messages,
  xml 
)

Definition at line 195 of file mavgen_cs.py.

def pymavlink.generator.mavgen_cs.generate_Deserialization (   outf,
  messages 
)

Definition at line 131 of file mavgen_cs.py.

def pymavlink.generator.mavgen_cs.generate_enums (   outf,
  enums 
)

Definition at line 74 of file mavgen_cs.py.

def pymavlink.generator.mavgen_cs.generate_preamble (   outf,
  msgs,
  args,
  xml 
)

Definition at line 52 of file mavgen_cs.py.

def pymavlink.generator.mavgen_cs.generate_Serialization (   outf,
  messages 
)

Definition at line 160 of file mavgen_cs.py.

def pymavlink.generator.mavgen_cs.generate_xmlDocSummary (   outf,
  summaryText,
  tabDepth 
)

Definition at line 66 of file mavgen_cs.py.

Variable Documentation

dictionary pymavlink.generator.mavgen_cs.map
Initial value:
1 = {
2  'float' : 'float',
3  'double' : 'double',
4  'char' : 'byte',
5  'int8_t' : 'sbyte',
6  'uint8_t' : 'byte',
7  'uint8_t_mavlink_version' : 'B',
8  'int16_t' : 'Int16',
9  'uint16_t' : 'UInt16',
10  'int32_t' : 'Int32',
11  'uint32_t' : 'UInt32',
12  'int64_t' : 'Int64',
13  'uint64_t' : 'UInt64',
14  }

Definition at line 17 of file mavgen_cs.py.

dictionary pymavlink.generator.mavgen_cs.mapFieldName
Initial value:
1 = {
2  'fixed' : '@fixed'
3  }

Definition at line 48 of file mavgen_cs.py.

dictionary pymavlink.generator.mavgen_cs.mapType
Initial value:
1 = {
2  'float' : ('ToSingle', 4),
3  'double' : ('ToDouble', 8),
4  'int8_t' : ('ToInt8', 1),
5  'uint8_t' : ('ToUInt8', 1),
6  'char' : ('ToChar', 1),
7  'int16_t' : ('ToInt16', 2),
8  'uint16_t' : ('ToUInt16', 2),
9  'int32_t' : ('ToInt32', 4),
10  'uint32_t' : ('ToUInt32', 4),
11  'int64_t' : ('ToInt64', 8),
12  'uint64_t' : ('ToUInt64', 8),
13  }

Definition at line 33 of file mavgen_cs.py.

pymavlink.generator.mavgen_cs.t = mavtemplate.MAVTemplate()

Definition at line 14 of file mavgen_cs.py.



mavlink
Author(s): Lorenz Meier
autogenerated on Sun Jul 7 2019 03:22:08