Classes | |
enum | MAV_states |
Public Member Functions | |
MAVLinkPacket | mavlink_parse_char (int c) |
Public Attributes | |
MAVLinkStats | stats = new MAVLinkStats() |
Package Attributes | |
MAV_states | state = MAV_states.MAVLINK_PARSE_STATE_UNINIT |
Static Package Attributes | |
static boolean | msg_received |
Private Attributes | |
MAVLinkPacket | m |
Definition at line 12 of file Parser.java.
MAVLinkPacket com.MAVLink.Parser.mavlink_parse_char | ( | int | c | ) | [inline] |
This is a convenience function which handles the complete MAVLink parsing. the function will parse one byte at a time and return the complete packet once it could be successfully decoded. Checksum and other failures will be silently ignored.
c | The char to parse |
Definition at line 37 of file Parser.java.
MAVLinkPacket com.MAVLink.Parser.m [private] |
Definition at line 26 of file Parser.java.
boolean com.MAVLink.Parser.msg_received [static, package] |
Definition at line 23 of file Parser.java.
Definition at line 21 of file Parser.java.
Definition at line 25 of file Parser.java.