Go to the source code of this file.
|  | 
| static void | mavlink_msg_mission_set_current_decode (const mavlink_message_t *msg, mavlink_mission_set_current_t *mission_set_current) | 
|  | Decode a mission_set_current message into a struct.  More... 
 | 
|  | 
| static uint16_t | mavlink_msg_mission_set_current_encode (uint8_t system_id, uint8_t component_id, mavlink_message_t *msg, const mavlink_mission_set_current_t *mission_set_current) | 
|  | Encode a mission_set_current struct.  More... 
 | 
|  | 
| static uint16_t | mavlink_msg_mission_set_current_encode_chan (uint8_t system_id, uint8_t component_id, uint8_t chan, mavlink_message_t *msg, const mavlink_mission_set_current_t *mission_set_current) | 
|  | Encode a mission_set_current struct on a channel.  More... 
 | 
|  | 
| static uint16_t | mavlink_msg_mission_set_current_get_seq (const mavlink_message_t *msg) | 
|  | Get field seq from mission_set_current message.  More... 
 | 
|  | 
| static uint8_t | mavlink_msg_mission_set_current_get_target_component (const mavlink_message_t *msg) | 
|  | Get field target_component from mission_set_current message.  More... 
 | 
|  | 
| static uint8_t | mavlink_msg_mission_set_current_get_target_system (const mavlink_message_t *msg) | 
|  | Send a mission_set_current message.  More... 
 | 
|  | 
| static uint16_t | mavlink_msg_mission_set_current_pack (uint8_t system_id, uint8_t component_id, mavlink_message_t *msg, uint8_t target_system, uint8_t target_component, uint16_t seq) | 
|  | Pack a mission_set_current message.  More... 
 | 
|  | 
| static uint16_t | mavlink_msg_mission_set_current_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, uint16_t seq) | 
|  | Pack a mission_set_current message on a channel.  More... 
 | 
|  | 
      
        
          | #define MAVLINK_MESSAGE_INFO_MISSION_SET_CURRENT | 
      
 
 
      
        
          | #define MAVLINK_MSG_ID_41_CRC   28 | 
      
 
 
      
        
          | #define MAVLINK_MSG_ID_41_LEN   4 | 
      
 
 
      
        
          | #define MAVLINK_MSG_ID_MISSION_SET_CURRENT   41 | 
      
 
 
      
        
          | #define MAVLINK_MSG_ID_MISSION_SET_CURRENT_CRC   28 | 
      
 
 
      
        
          | #define MAVLINK_MSG_ID_MISSION_SET_CURRENT_LEN   4 | 
      
 
 
Decode a mission_set_current message into a struct. 
- Parameters
- 
  
    | msg | The message to decode |  | mission_set_current | C-struct to decode the message contents into |  
 
Definition at line 248 of file mavlink_msg_mission_set_current.h.
 
 
  
  | 
        
          | static uint16_t mavlink_msg_mission_set_current_encode | ( | uint8_t | system_id, |  
          |  |  | uint8_t | component_id, |  
          |  |  | mavlink_message_t * | msg, |  
          |  |  | const mavlink_mission_set_current_t * | mission_set_current |  
          |  | ) |  |  |  | inlinestatic | 
 
Encode a mission_set_current 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_set_current | C-struct to read the message contents from |  
 
Definition at line 115 of file mavlink_msg_mission_set_current.h.
 
 
  
  | 
        
          | static uint16_t mavlink_msg_mission_set_current_encode_chan | ( | uint8_t | system_id, |  
          |  |  | uint8_t | component_id, |  
          |  |  | uint8_t | chan, |  
          |  |  | mavlink_message_t * | msg, |  
          |  |  | const mavlink_mission_set_current_t * | mission_set_current |  
          |  | ) |  |  |  | inlinestatic | 
 
Encode a mission_set_current 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_set_current | C-struct to read the message contents from |  
 
Definition at line 129 of file mavlink_msg_mission_set_current.h.
 
 
  
  | 
        
          | static uint16_t mavlink_msg_mission_set_current_get_seq | ( | const mavlink_message_t * | msg | ) |  |  | inlinestatic | 
 
 
  
  | 
        
          | static uint8_t mavlink_msg_mission_set_current_get_target_component | ( | const mavlink_message_t * | msg | ) |  |  | inlinestatic | 
 
 
  
  | 
        
          | static uint8_t mavlink_msg_mission_set_current_get_target_system | ( | const mavlink_message_t * | msg | ) |  |  | inlinestatic | 
 
Send a mission_set_current message. 
- Parameters
- 
  
    | chan | MAVLink channel to send the message |  | target_system | System ID |  | target_component | Component ID |  | seq | Sequence Get field target_system from mission_set_current message |  
 
- Returns
- System ID 
Definition at line 217 of file mavlink_msg_mission_set_current.h.
 
 
  
  | 
        
          | static uint16_t mavlink_msg_mission_set_current_pack | ( | uint8_t | system_id, |  
          |  |  | uint8_t | component_id, |  
          |  |  | mavlink_message_t * | msg, |  
          |  |  | uint8_t | target_system, |  
          |  |  | uint8_t | target_component, |  
          |  |  | uint16_t | seq |  
          |  | ) |  |  |  | inlinestatic | 
 
Pack a mission_set_current 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 |  | seq | Sequence |  
 
- Returns
- length of the message in bytes (excluding serial stream start sign) 
Definition at line 41 of file mavlink_msg_mission_set_current.h.
 
 
  
  | 
        
          | static uint16_t mavlink_msg_mission_set_current_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, |  
          |  |  | uint16_t | seq |  
          |  | ) |  |  |  | inlinestatic | 
 
Pack a mission_set_current 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 |  | seq | Sequence |  
 
- Returns
- length of the message in bytes (excluding serial stream start sign) 
Definition at line 79 of file mavlink_msg_mission_set_current.h.