Classes | |
class | MAVEnum |
class | MAVEnumEntry |
class | MAVEnumParam |
class | MAVField |
class | MAVParseError |
class | MAVType |
class | MAVXML |
Functions | |
def | check_duplicates |
def | merge_enums |
def | message_checksum |
def | mkdir_p |
def | total_msgs |
Variables | |
int | FLAG_HAVE_TARGET_COMPONENT = 2 |
int | FLAG_HAVE_TARGET_SYSTEM = 1 |
string | PROTOCOL_0_9 = "0.9" |
string | PROTOCOL_1_0 = "1.0" |
string | PROTOCOL_2_0 = "2.0" |
check for duplicate message IDs
Definition at line 429 of file mavparse.py.
def pymavlink.generator.mavparse.merge_enums | ( | xml | ) |
merge enums between XML files
Definition at line 396 of file mavparse.py.
calculate a 8-bit checksum of the key fields of a message, so we can detect incompatible XML changes
Definition at line 379 of file mavparse.py.
def pymavlink.generator.mavparse.mkdir_p | ( | dir | ) |
Definition at line 480 of file mavparse.py.
def pymavlink.generator.mavparse.total_msgs | ( | xml | ) |
count total number of msgs
Definition at line 473 of file mavparse.py.
Definition at line 17 of file mavparse.py.
Definition at line 16 of file mavparse.py.
string pymavlink::generator::mavparse::PROTOCOL_0_9 = "0.9" |
Definition at line 11 of file mavparse.py.
string pymavlink::generator::mavparse::PROTOCOL_1_0 = "1.0" |
Definition at line 12 of file mavparse.py.
string pymavlink::generator::mavparse::PROTOCOL_2_0 = "2.0" |
Definition at line 13 of file mavparse.py.