mavlink_msg_set_mode.h
Go to the documentation of this file.
00001 // MESSAGE SET_MODE PACKING
00002 
00003 #define MAVLINK_MSG_ID_SET_MODE 11
00004 
00005 typedef struct __mavlink_set_mode_t
00006 {
00007  uint32_t custom_mode; /*< The new autopilot-specific mode. This field can be ignored by an autopilot.*/
00008  uint8_t target_system; /*< The system setting the mode*/
00009  uint8_t base_mode; /*< The new base mode*/
00010 } mavlink_set_mode_t;
00011 
00012 #define MAVLINK_MSG_ID_SET_MODE_LEN 6
00013 #define MAVLINK_MSG_ID_11_LEN 6
00014 
00015 #define MAVLINK_MSG_ID_SET_MODE_CRC 89
00016 #define MAVLINK_MSG_ID_11_CRC 89
00017 
00018 
00019 
00020 #define MAVLINK_MESSAGE_INFO_SET_MODE { \
00021         "SET_MODE", \
00022         3, \
00023         {  { "custom_mode", NULL, MAVLINK_TYPE_UINT32_T, 0, 0, offsetof(mavlink_set_mode_t, custom_mode) }, \
00024          { "target_system", NULL, MAVLINK_TYPE_UINT8_T, 0, 4, offsetof(mavlink_set_mode_t, target_system) }, \
00025          { "base_mode", NULL, MAVLINK_TYPE_UINT8_T, 0, 5, offsetof(mavlink_set_mode_t, base_mode) }, \
00026          } \
00027 }
00028 
00029 
00041 static inline uint16_t mavlink_msg_set_mode_pack(uint8_t system_id, uint8_t component_id, mavlink_message_t* msg,
00042                                                        uint8_t target_system, uint8_t base_mode, uint32_t custom_mode)
00043 {
00044 #if MAVLINK_NEED_BYTE_SWAP || !MAVLINK_ALIGNED_FIELDS
00045         char buf[MAVLINK_MSG_ID_SET_MODE_LEN];
00046         _mav_put_uint32_t(buf, 0, custom_mode);
00047         _mav_put_uint8_t(buf, 4, target_system);
00048         _mav_put_uint8_t(buf, 5, base_mode);
00049 
00050         memcpy(_MAV_PAYLOAD_NON_CONST(msg), buf, MAVLINK_MSG_ID_SET_MODE_LEN);
00051 #else
00052         mavlink_set_mode_t packet;
00053         packet.custom_mode = custom_mode;
00054         packet.target_system = target_system;
00055         packet.base_mode = base_mode;
00056 
00057         memcpy(_MAV_PAYLOAD_NON_CONST(msg), &packet, MAVLINK_MSG_ID_SET_MODE_LEN);
00058 #endif
00059 
00060         msg->msgid = MAVLINK_MSG_ID_SET_MODE;
00061 #if MAVLINK_CRC_EXTRA
00062     return mavlink_finalize_message(msg, system_id, component_id, MAVLINK_MSG_ID_SET_MODE_LEN, MAVLINK_MSG_ID_SET_MODE_CRC);
00063 #else
00064     return mavlink_finalize_message(msg, system_id, component_id, MAVLINK_MSG_ID_SET_MODE_LEN);
00065 #endif
00066 }
00067 
00079 static inline uint16_t mavlink_msg_set_mode_pack_chan(uint8_t system_id, uint8_t component_id, uint8_t chan,
00080                                                            mavlink_message_t* msg,
00081                                                            uint8_t target_system,uint8_t base_mode,uint32_t custom_mode)
00082 {
00083 #if MAVLINK_NEED_BYTE_SWAP || !MAVLINK_ALIGNED_FIELDS
00084         char buf[MAVLINK_MSG_ID_SET_MODE_LEN];
00085         _mav_put_uint32_t(buf, 0, custom_mode);
00086         _mav_put_uint8_t(buf, 4, target_system);
00087         _mav_put_uint8_t(buf, 5, base_mode);
00088 
00089         memcpy(_MAV_PAYLOAD_NON_CONST(msg), buf, MAVLINK_MSG_ID_SET_MODE_LEN);
00090 #else
00091         mavlink_set_mode_t packet;
00092         packet.custom_mode = custom_mode;
00093         packet.target_system = target_system;
00094         packet.base_mode = base_mode;
00095 
00096         memcpy(_MAV_PAYLOAD_NON_CONST(msg), &packet, MAVLINK_MSG_ID_SET_MODE_LEN);
00097 #endif
00098 
00099         msg->msgid = MAVLINK_MSG_ID_SET_MODE;
00100 #if MAVLINK_CRC_EXTRA
00101     return mavlink_finalize_message_chan(msg, system_id, component_id, chan, MAVLINK_MSG_ID_SET_MODE_LEN, MAVLINK_MSG_ID_SET_MODE_CRC);
00102 #else
00103     return mavlink_finalize_message_chan(msg, system_id, component_id, chan, MAVLINK_MSG_ID_SET_MODE_LEN);
00104 #endif
00105 }
00106 
00115 static inline uint16_t mavlink_msg_set_mode_encode(uint8_t system_id, uint8_t component_id, mavlink_message_t* msg, const mavlink_set_mode_t* set_mode)
00116 {
00117         return mavlink_msg_set_mode_pack(system_id, component_id, msg, set_mode->target_system, set_mode->base_mode, set_mode->custom_mode);
00118 }
00119 
00129 static inline uint16_t mavlink_msg_set_mode_encode_chan(uint8_t system_id, uint8_t component_id, uint8_t chan, mavlink_message_t* msg, const mavlink_set_mode_t* set_mode)
00130 {
00131         return mavlink_msg_set_mode_pack_chan(system_id, component_id, chan, msg, set_mode->target_system, set_mode->base_mode, set_mode->custom_mode);
00132 }
00133 
00142 #ifdef MAVLINK_USE_CONVENIENCE_FUNCTIONS
00143 
00144 static inline void mavlink_msg_set_mode_send(mavlink_channel_t chan, uint8_t target_system, uint8_t base_mode, uint32_t custom_mode)
00145 {
00146 #if MAVLINK_NEED_BYTE_SWAP || !MAVLINK_ALIGNED_FIELDS
00147         char buf[MAVLINK_MSG_ID_SET_MODE_LEN];
00148         _mav_put_uint32_t(buf, 0, custom_mode);
00149         _mav_put_uint8_t(buf, 4, target_system);
00150         _mav_put_uint8_t(buf, 5, base_mode);
00151 
00152 #if MAVLINK_CRC_EXTRA
00153     _mav_finalize_message_chan_send(chan, MAVLINK_MSG_ID_SET_MODE, buf, MAVLINK_MSG_ID_SET_MODE_LEN, MAVLINK_MSG_ID_SET_MODE_CRC);
00154 #else
00155     _mav_finalize_message_chan_send(chan, MAVLINK_MSG_ID_SET_MODE, buf, MAVLINK_MSG_ID_SET_MODE_LEN);
00156 #endif
00157 #else
00158         mavlink_set_mode_t packet;
00159         packet.custom_mode = custom_mode;
00160         packet.target_system = target_system;
00161         packet.base_mode = base_mode;
00162 
00163 #if MAVLINK_CRC_EXTRA
00164     _mav_finalize_message_chan_send(chan, MAVLINK_MSG_ID_SET_MODE, (const char *)&packet, MAVLINK_MSG_ID_SET_MODE_LEN, MAVLINK_MSG_ID_SET_MODE_CRC);
00165 #else
00166     _mav_finalize_message_chan_send(chan, MAVLINK_MSG_ID_SET_MODE, (const char *)&packet, MAVLINK_MSG_ID_SET_MODE_LEN);
00167 #endif
00168 #endif
00169 }
00170 
00171 #if MAVLINK_MSG_ID_SET_MODE_LEN <= MAVLINK_MAX_PAYLOAD_LEN
00172 /*
00173   This varient of _send() can be used to save stack space by re-using
00174   memory from the receive buffer.  The caller provides a
00175   mavlink_message_t which is the size of a full mavlink message. This
00176   is usually the receive buffer for the channel, and allows a reply to an
00177   incoming message with minimum stack space usage.
00178  */
00179 static inline void mavlink_msg_set_mode_send_buf(mavlink_message_t *msgbuf, mavlink_channel_t chan,  uint8_t target_system, uint8_t base_mode, uint32_t custom_mode)
00180 {
00181 #if MAVLINK_NEED_BYTE_SWAP || !MAVLINK_ALIGNED_FIELDS
00182         char *buf = (char *)msgbuf;
00183         _mav_put_uint32_t(buf, 0, custom_mode);
00184         _mav_put_uint8_t(buf, 4, target_system);
00185         _mav_put_uint8_t(buf, 5, base_mode);
00186 
00187 #if MAVLINK_CRC_EXTRA
00188     _mav_finalize_message_chan_send(chan, MAVLINK_MSG_ID_SET_MODE, buf, MAVLINK_MSG_ID_SET_MODE_LEN, MAVLINK_MSG_ID_SET_MODE_CRC);
00189 #else
00190     _mav_finalize_message_chan_send(chan, MAVLINK_MSG_ID_SET_MODE, buf, MAVLINK_MSG_ID_SET_MODE_LEN);
00191 #endif
00192 #else
00193         mavlink_set_mode_t *packet = (mavlink_set_mode_t *)msgbuf;
00194         packet->custom_mode = custom_mode;
00195         packet->target_system = target_system;
00196         packet->base_mode = base_mode;
00197 
00198 #if MAVLINK_CRC_EXTRA
00199     _mav_finalize_message_chan_send(chan, MAVLINK_MSG_ID_SET_MODE, (const char *)packet, MAVLINK_MSG_ID_SET_MODE_LEN, MAVLINK_MSG_ID_SET_MODE_CRC);
00200 #else
00201     _mav_finalize_message_chan_send(chan, MAVLINK_MSG_ID_SET_MODE, (const char *)packet, MAVLINK_MSG_ID_SET_MODE_LEN);
00202 #endif
00203 #endif
00204 }
00205 #endif
00206 
00207 #endif
00208 
00209 // MESSAGE SET_MODE UNPACKING
00210 
00211 
00217 static inline uint8_t mavlink_msg_set_mode_get_target_system(const mavlink_message_t* msg)
00218 {
00219         return _MAV_RETURN_uint8_t(msg,  4);
00220 }
00221 
00227 static inline uint8_t mavlink_msg_set_mode_get_base_mode(const mavlink_message_t* msg)
00228 {
00229         return _MAV_RETURN_uint8_t(msg,  5);
00230 }
00231 
00237 static inline uint32_t mavlink_msg_set_mode_get_custom_mode(const mavlink_message_t* msg)
00238 {
00239         return _MAV_RETURN_uint32_t(msg,  0);
00240 }
00241 
00248 static inline void mavlink_msg_set_mode_decode(const mavlink_message_t* msg, mavlink_set_mode_t* set_mode)
00249 {
00250 #if MAVLINK_NEED_BYTE_SWAP
00251         set_mode->custom_mode = mavlink_msg_set_mode_get_custom_mode(msg);
00252         set_mode->target_system = mavlink_msg_set_mode_get_target_system(msg);
00253         set_mode->base_mode = mavlink_msg_set_mode_get_base_mode(msg);
00254 #else
00255         memcpy(set_mode, _MAV_PAYLOAD(msg), MAVLINK_MSG_ID_SET_MODE_LEN);
00256 #endif
00257 }


dji_sdk_dji2mav
Author(s):
autogenerated on Thu Jun 6 2019 17:55:35