Functions | |
def | generate |
def | generate_classes |
def | generate_CodecIndex |
def | generate_Deserialization |
def | generate_enums |
def | generate_preamble |
def | generate_Serialization |
def | generate_xmlDocSummary |
Variables | |
dictionary | map |
dictionary | mapFieldName |
dictionary | mapType |
tuple | t = mavtemplate.MAVTemplate() |
def pymavlink.generator.mavgen_cs.generate | ( | basename, | |
xml | |||
) |
generate complete MAVLink CSharp implemenation
Definition at line 254 of file mavgen_cs.py.
def pymavlink.generator.mavgen_cs.generate_classes | ( | outf, | |
msgs | |||
) |
Definition at line 86 of file mavgen_cs.py.
def pymavlink.generator.mavgen_cs.generate_CodecIndex | ( | outf, | |
messages, | |||
xml | |||
) |
Definition at line 191 of file mavgen_cs.py.
def pymavlink.generator.mavgen_cs.generate_Deserialization | ( | outf, | |
messages | |||
) |
Definition at line 127 of file mavgen_cs.py.
def pymavlink.generator.mavgen_cs.generate_enums | ( | outf, | |
enums | |||
) |
Definition at line 70 of file mavgen_cs.py.
def pymavlink.generator.mavgen_cs.generate_preamble | ( | outf, | |
msgs, | |||
args, | |||
xml | |||
) |
Definition at line 48 of file mavgen_cs.py.
def pymavlink.generator.mavgen_cs.generate_Serialization | ( | outf, | |
messages | |||
) |
Definition at line 156 of file mavgen_cs.py.
def pymavlink.generator.mavgen_cs.generate_xmlDocSummary | ( | outf, | |
summaryText, | |||
tabDepth | |||
) |
Definition at line 62 of file mavgen_cs.py.
dictionary pymavlink::generator::mavgen_cs::map |
00001 { 00002 'float' : 'float', 00003 'double' : 'double', 00004 'char' : 'byte', 00005 'int8_t' : 'sbyte', 00006 'uint8_t' : 'byte', 00007 'uint8_t_mavlink_version' : 'B', 00008 'int16_t' : 'Int16', 00009 'uint16_t' : 'UInt16', 00010 'int32_t' : 'Int32', 00011 'uint32_t' : 'UInt32', 00012 'int64_t' : 'Int64', 00013 'uint64_t' : 'UInt64', 00014 }
Definition at line 13 of file mavgen_cs.py.
00001 { 00002 'fixed' : '@fixed' 00003 }
Definition at line 44 of file mavgen_cs.py.
dictionary pymavlink::generator::mavgen_cs::mapType |
00001 { 00002 'float' : ('ToSingle', 4), 00003 'double' : ('ToDouble', 8), 00004 'int8_t' : ('ToInt8', 1), 00005 'uint8_t' : ('ToUInt8', 1), 00006 'char' : ('ToChar', 1), 00007 'int16_t' : ('ToInt16', 2), 00008 'uint16_t' : ('ToUInt16', 2), 00009 'int32_t' : ('ToInt32', 4), 00010 'uint32_t' : ('ToUInt32', 4), 00011 'int64_t' : ('ToInt64', 8), 00012 'uint64_t' : ('ToUInt64', 8), 00013 }
Definition at line 29 of file mavgen_cs.py.
Definition at line 10 of file mavgen_cs.py.