Go to the source code of this file.
|  | 
| static void | mavlink_msg_mission_ack_decode (const mavlink_message_t *msg, mavlink_mission_ack_t *mission_ack) | 
|  | Decode a mission_ack message into a struct.  More... 
 | 
|  | 
| static uint16_t | mavlink_msg_mission_ack_encode (uint8_t system_id, uint8_t component_id, mavlink_message_t *msg, const mavlink_mission_ack_t *mission_ack) | 
|  | Encode a mission_ack struct.  More... 
 | 
|  | 
| static uint16_t | mavlink_msg_mission_ack_encode_chan (uint8_t system_id, uint8_t component_id, uint8_t chan, mavlink_message_t *msg, const mavlink_mission_ack_t *mission_ack) | 
|  | Encode a mission_ack struct on a channel.  More... 
 | 
|  | 
| static uint8_t | mavlink_msg_mission_ack_get_target_component (const mavlink_message_t *msg) | 
|  | Get field target_component from mission_ack message.  More... 
 | 
|  | 
| static uint8_t | mavlink_msg_mission_ack_get_target_system (const mavlink_message_t *msg) | 
|  | Send a mission_ack message.  More... 
 | 
|  | 
| static uint8_t | mavlink_msg_mission_ack_get_type (const mavlink_message_t *msg) | 
|  | Get field type from mission_ack message.  More... 
 | 
|  | 
| static uint16_t | mavlink_msg_mission_ack_pack (uint8_t system_id, uint8_t component_id, mavlink_message_t *msg, uint8_t target_system, uint8_t target_component, uint8_t type) | 
|  | Pack a mission_ack message.  More... 
 | 
|  | 
| static uint16_t | mavlink_msg_mission_ack_pack_chan (uint8_t system_id, uint8_t component_id, uint8_t chan, mavlink_message_t *msg, uint8_t target_system, uint8_t target_component, uint8_t type) | 
|  | Pack a mission_ack message on a channel.  More... 
 | 
|  | 
      
        
          | #define MAVLINK_MESSAGE_INFO_MISSION_ACK | 
      
 
 
      
        
          | #define MAVLINK_MSG_ID_47_CRC   153 | 
      
 
 
      
        
          | #define MAVLINK_MSG_ID_47_LEN   3 | 
      
 
 
      
        
          | #define MAVLINK_MSG_ID_MISSION_ACK   47 | 
      
 
 
      
        
          | #define MAVLINK_MSG_ID_MISSION_ACK_CRC   153 | 
      
 
 
      
        
          | #define MAVLINK_MSG_ID_MISSION_ACK_LEN   3 | 
      
 
 
  
  | 
        
          | static void mavlink_msg_mission_ack_decode | ( | const mavlink_message_t * | msg, |  
          |  |  | mavlink_mission_ack_t * | mission_ack |  
          |  | ) |  |  |  | inlinestatic | 
 
Decode a mission_ack message into a struct. 
- Parameters
- 
  
    | msg | The message to decode |  | mission_ack | C-struct to decode the message contents into |  
 
Definition at line 248 of file mavlink_msg_mission_ack.h.
 
 
  
  | 
        
          | static uint16_t mavlink_msg_mission_ack_encode | ( | uint8_t | system_id, |  
          |  |  | uint8_t | component_id, |  
          |  |  | mavlink_message_t * | msg, |  
          |  |  | const mavlink_mission_ack_t * | mission_ack |  
          |  | ) |  |  |  | inlinestatic | 
 
Encode a mission_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 |  | mission_ack | C-struct to read the message contents from |  
 
Definition at line 115 of file mavlink_msg_mission_ack.h.
 
 
  
  | 
        
          | static uint16_t mavlink_msg_mission_ack_encode_chan | ( | uint8_t | system_id, |  
          |  |  | uint8_t | component_id, |  
          |  |  | uint8_t | chan, |  
          |  |  | mavlink_message_t * | msg, |  
          |  |  | const mavlink_mission_ack_t * | mission_ack |  
          |  | ) |  |  |  | inlinestatic | 
 
Encode a mission_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 |  | mission_ack | C-struct to read the message contents from |  
 
Definition at line 129 of file mavlink_msg_mission_ack.h.
 
 
  
  | 
        
          | static uint8_t mavlink_msg_mission_ack_get_target_component | ( | const mavlink_message_t * | msg | ) |  |  | inlinestatic | 
 
 
  
  | 
        
          | static uint8_t mavlink_msg_mission_ack_get_target_system | ( | const mavlink_message_t * | msg | ) |  |  | inlinestatic | 
 
Send a mission_ack message. 
- Parameters
- 
  
    | chan | MAVLink channel to send the message |  | target_system | System ID |  | target_component | Component ID |  | type | See MAV_MISSION_RESULT enum Get field target_system from mission_ack message |  
 
- Returns
- System ID 
Definition at line 217 of file mavlink_msg_mission_ack.h.
 
 
  
  | 
        
          | static uint8_t mavlink_msg_mission_ack_get_type | ( | const mavlink_message_t * | msg | ) |  |  | inlinestatic | 
 
 
  
  | 
        
          | static uint16_t mavlink_msg_mission_ack_pack | ( | uint8_t | system_id, |  
          |  |  | uint8_t | component_id, |  
          |  |  | mavlink_message_t * | msg, |  
          |  |  | uint8_t | target_system, |  
          |  |  | uint8_t | target_component, |  
          |  |  | uint8_t | type |  
          |  | ) |  |  |  | inlinestatic | 
 
Pack a mission_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 |  | target_system | System ID |  | target_component | Component ID |  | type | See MAV_MISSION_RESULT enum |  
 
- Returns
- length of the message in bytes (excluding serial stream start sign) 
Definition at line 41 of file mavlink_msg_mission_ack.h.
 
 
  
  | 
        
          | static uint16_t mavlink_msg_mission_ack_pack_chan | ( | uint8_t | system_id, |  
          |  |  | uint8_t | component_id, |  
          |  |  | uint8_t | chan, |  
          |  |  | mavlink_message_t * | msg, |  
          |  |  | uint8_t | target_system, |  
          |  |  | uint8_t | target_component, |  
          |  |  | uint8_t | type |  
          |  | ) |  |  |  | inlinestatic | 
 
Pack a mission_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 |  | target_system | System ID |  | target_component | Component ID |  | type | See MAV_MISSION_RESULT enum |  
 
- Returns
- length of the message in bytes (excluding serial stream start sign) 
Definition at line 79 of file mavlink_msg_mission_ack.h.