Go to the source code of this file.
|  | 
| static void | mavlink_msg_command_ack_decode (const mavlink_message_t *msg, mavlink_command_ack_t *command_ack) | 
|  | Decode a command_ack message into a struct.  More... 
 | 
|  | 
| static uint16_t | mavlink_msg_command_ack_encode (uint8_t system_id, uint8_t component_id, mavlink_message_t *msg, const mavlink_command_ack_t *command_ack) | 
|  | Encode a command_ack struct.  More... 
 | 
|  | 
| static uint16_t | mavlink_msg_command_ack_encode_chan (uint8_t system_id, uint8_t component_id, uint8_t chan, mavlink_message_t *msg, const mavlink_command_ack_t *command_ack) | 
|  | Encode a command_ack struct on a channel.  More... 
 | 
|  | 
| static uint16_t | mavlink_msg_command_ack_get_command (const mavlink_message_t *msg) | 
|  | Send a command_ack message.  More... 
 | 
|  | 
| static uint8_t | mavlink_msg_command_ack_get_result (const mavlink_message_t *msg) | 
|  | Get field result from command_ack message.  More... 
 | 
|  | 
| static uint16_t | mavlink_msg_command_ack_pack (uint8_t system_id, uint8_t component_id, mavlink_message_t *msg, uint16_t command, uint8_t result) | 
|  | Pack a command_ack message.  More... 
 | 
|  | 
| static uint16_t | mavlink_msg_command_ack_pack_chan (uint8_t system_id, uint8_t component_id, uint8_t chan, mavlink_message_t *msg, uint16_t command, uint8_t result) | 
|  | Pack a command_ack message on a channel.  More... 
 | 
|  | 
      
        
          | #define MAVLINK_MESSAGE_INFO_COMMAND_ACK | 
      
 
 
      
        
          | #define MAVLINK_MSG_ID_77_CRC   143 | 
      
 
 
      
        
          | #define MAVLINK_MSG_ID_77_LEN   3 | 
      
 
 
      
        
          | #define MAVLINK_MSG_ID_COMMAND_ACK   77 | 
      
 
 
      
        
          | #define MAVLINK_MSG_ID_COMMAND_ACK_CRC   143 | 
      
 
 
      
        
          | #define MAVLINK_MSG_ID_COMMAND_ACK_LEN   3 | 
      
 
 
  
  | 
        
          | static void mavlink_msg_command_ack_decode | ( | const mavlink_message_t * | msg, |  
          |  |  | mavlink_command_ack_t * | command_ack |  
          |  | ) |  |  |  | inlinestatic | 
 
Decode a command_ack message into a struct. 
- Parameters
- 
  
    | msg | The message to decode |  | command_ack | C-struct to decode the message contents into |  
 
Definition at line 225 of file mavlink_msg_command_ack.h.
 
 
  
  | 
        
          | static uint16_t mavlink_msg_command_ack_encode | ( | uint8_t | system_id, |  
          |  |  | uint8_t | component_id, |  
          |  |  | mavlink_message_t * | msg, |  
          |  |  | const mavlink_command_ack_t * | command_ack |  
          |  | ) |  |  |  | inlinestatic | 
 
Encode a command_ack struct. 
- Parameters
- 
  
    | system_id | ID of this system |  | component_id | ID of this component (e.g. 200 for IMU) |  | msg | The MAVLink message to compress the data into |  | command_ack | C-struct to read the message contents from |  
 
Definition at line 107 of file mavlink_msg_command_ack.h.
 
 
  
  | 
        
          | static uint16_t mavlink_msg_command_ack_encode_chan | ( | uint8_t | system_id, |  
          |  |  | uint8_t | component_id, |  
          |  |  | uint8_t | chan, |  
          |  |  | mavlink_message_t * | msg, |  
          |  |  | const mavlink_command_ack_t * | command_ack |  
          |  | ) |  |  |  | inlinestatic | 
 
Encode a command_ack struct on a channel. 
- Parameters
- 
  
    | system_id | ID of this system |  | component_id | ID of this component (e.g. 200 for IMU) |  | chan | The MAVLink channel this message will be sent over |  | msg | The MAVLink message to compress the data into |  | command_ack | C-struct to read the message contents from |  
 
Definition at line 121 of file mavlink_msg_command_ack.h.
 
 
  
  | 
        
          | static uint16_t mavlink_msg_command_ack_get_command | ( | const mavlink_message_t * | msg | ) |  |  | inlinestatic | 
 
Send a command_ack message. 
- Parameters
- 
  
    | chan | MAVLink channel to send the message |  | command | Command ID, as defined by MAV_CMD enum. |  | result | See MAV_RESULT enum Get field command from command_ack message |  
 
- Returns
- Command ID, as defined by MAV_CMD enum. 
Definition at line 204 of file mavlink_msg_command_ack.h.
 
 
  
  | 
        
          | static uint8_t mavlink_msg_command_ack_get_result | ( | const mavlink_message_t * | msg | ) |  |  | inlinestatic | 
 
 
  
  | 
        
          | static uint16_t mavlink_msg_command_ack_pack | ( | uint8_t | system_id, |  
          |  |  | uint8_t | component_id, |  
          |  |  | mavlink_message_t * | msg, |  
          |  |  | uint16_t | command, |  
          |  |  | uint8_t | result |  
          |  | ) |  |  |  | inlinestatic | 
 
Pack a command_ack message. 
- Parameters
- 
  
    | system_id | ID of this system |  | component_id | ID of this component (e.g. 200 for IMU) |  | msg | The MAVLink message to compress the data into |  | command | Command ID, as defined by MAV_CMD enum. |  | result | See MAV_RESULT enum |  
 
- Returns
- length of the message in bytes (excluding serial stream start sign) 
Definition at line 38 of file mavlink_msg_command_ack.h.
 
 
  
  | 
        
          | static uint16_t mavlink_msg_command_ack_pack_chan | ( | uint8_t | system_id, |  
          |  |  | uint8_t | component_id, |  
          |  |  | uint8_t | chan, |  
          |  |  | mavlink_message_t * | msg, |  
          |  |  | uint16_t | command, |  
          |  |  | uint8_t | result |  
          |  | ) |  |  |  | inlinestatic | 
 
Pack a command_ack message on a channel. 
- Parameters
- 
  
    | system_id | ID of this system |  | component_id | ID of this component (e.g. 200 for IMU) |  | chan | The MAVLink channel this message will be sent over |  | msg | The MAVLink message to compress the data into |  | command | Command ID, as defined by MAV_CMD enum. |  | result | See MAV_RESULT enum |  
 
- Returns
- length of the message in bytes (excluding serial stream start sign) 
Definition at line 73 of file mavlink_msg_command_ack.h.