mavlink_msg_data_stream.h
Go to the documentation of this file.
00001 // MESSAGE DATA_STREAM PACKING
00002 
00003 #define MAVLINK_MSG_ID_DATA_STREAM 67
00004 
00005 typedef struct __mavlink_data_stream_t
00006 {
00007  uint16_t message_rate; /*< The message rate*/
00008  uint8_t stream_id; /*< The ID of the requested data stream*/
00009  uint8_t on_off; /*< 1 stream is enabled, 0 stream is stopped.*/
00010 } mavlink_data_stream_t;
00011 
00012 #define MAVLINK_MSG_ID_DATA_STREAM_LEN 4
00013 #define MAVLINK_MSG_ID_67_LEN 4
00014 
00015 #define MAVLINK_MSG_ID_DATA_STREAM_CRC 21
00016 #define MAVLINK_MSG_ID_67_CRC 21
00017 
00018 
00019 
00020 #define MAVLINK_MESSAGE_INFO_DATA_STREAM { \
00021         "DATA_STREAM", \
00022         3, \
00023         {  { "message_rate", NULL, MAVLINK_TYPE_UINT16_T, 0, 0, offsetof(mavlink_data_stream_t, message_rate) }, \
00024          { "stream_id", NULL, MAVLINK_TYPE_UINT8_T, 0, 2, offsetof(mavlink_data_stream_t, stream_id) }, \
00025          { "on_off", NULL, MAVLINK_TYPE_UINT8_T, 0, 3, offsetof(mavlink_data_stream_t, on_off) }, \
00026          } \
00027 }
00028 
00029 
00041 static inline uint16_t mavlink_msg_data_stream_pack(uint8_t system_id, uint8_t component_id, mavlink_message_t* msg,
00042                                                        uint8_t stream_id, uint16_t message_rate, uint8_t on_off)
00043 {
00044 #if MAVLINK_NEED_BYTE_SWAP || !MAVLINK_ALIGNED_FIELDS
00045         char buf[MAVLINK_MSG_ID_DATA_STREAM_LEN];
00046         _mav_put_uint16_t(buf, 0, message_rate);
00047         _mav_put_uint8_t(buf, 2, stream_id);
00048         _mav_put_uint8_t(buf, 3, on_off);
00049 
00050         memcpy(_MAV_PAYLOAD_NON_CONST(msg), buf, MAVLINK_MSG_ID_DATA_STREAM_LEN);
00051 #else
00052         mavlink_data_stream_t packet;
00053         packet.message_rate = message_rate;
00054         packet.stream_id = stream_id;
00055         packet.on_off = on_off;
00056 
00057         memcpy(_MAV_PAYLOAD_NON_CONST(msg), &packet, MAVLINK_MSG_ID_DATA_STREAM_LEN);
00058 #endif
00059 
00060         msg->msgid = MAVLINK_MSG_ID_DATA_STREAM;
00061 #if MAVLINK_CRC_EXTRA
00062     return mavlink_finalize_message(msg, system_id, component_id, MAVLINK_MSG_ID_DATA_STREAM_LEN, MAVLINK_MSG_ID_DATA_STREAM_CRC);
00063 #else
00064     return mavlink_finalize_message(msg, system_id, component_id, MAVLINK_MSG_ID_DATA_STREAM_LEN);
00065 #endif
00066 }
00067 
00079 static inline uint16_t mavlink_msg_data_stream_pack_chan(uint8_t system_id, uint8_t component_id, uint8_t chan,
00080                                                            mavlink_message_t* msg,
00081                                                            uint8_t stream_id,uint16_t message_rate,uint8_t on_off)
00082 {
00083 #if MAVLINK_NEED_BYTE_SWAP || !MAVLINK_ALIGNED_FIELDS
00084         char buf[MAVLINK_MSG_ID_DATA_STREAM_LEN];
00085         _mav_put_uint16_t(buf, 0, message_rate);
00086         _mav_put_uint8_t(buf, 2, stream_id);
00087         _mav_put_uint8_t(buf, 3, on_off);
00088 
00089         memcpy(_MAV_PAYLOAD_NON_CONST(msg), buf, MAVLINK_MSG_ID_DATA_STREAM_LEN);
00090 #else
00091         mavlink_data_stream_t packet;
00092         packet.message_rate = message_rate;
00093         packet.stream_id = stream_id;
00094         packet.on_off = on_off;
00095 
00096         memcpy(_MAV_PAYLOAD_NON_CONST(msg), &packet, MAVLINK_MSG_ID_DATA_STREAM_LEN);
00097 #endif
00098 
00099         msg->msgid = MAVLINK_MSG_ID_DATA_STREAM;
00100 #if MAVLINK_CRC_EXTRA
00101     return mavlink_finalize_message_chan(msg, system_id, component_id, chan, MAVLINK_MSG_ID_DATA_STREAM_LEN, MAVLINK_MSG_ID_DATA_STREAM_CRC);
00102 #else
00103     return mavlink_finalize_message_chan(msg, system_id, component_id, chan, MAVLINK_MSG_ID_DATA_STREAM_LEN);
00104 #endif
00105 }
00106 
00115 static inline uint16_t mavlink_msg_data_stream_encode(uint8_t system_id, uint8_t component_id, mavlink_message_t* msg, const mavlink_data_stream_t* data_stream)
00116 {
00117         return mavlink_msg_data_stream_pack(system_id, component_id, msg, data_stream->stream_id, data_stream->message_rate, data_stream->on_off);
00118 }
00119 
00129 static inline uint16_t mavlink_msg_data_stream_encode_chan(uint8_t system_id, uint8_t component_id, uint8_t chan, mavlink_message_t* msg, const mavlink_data_stream_t* data_stream)
00130 {
00131         return mavlink_msg_data_stream_pack_chan(system_id, component_id, chan, msg, data_stream->stream_id, data_stream->message_rate, data_stream->on_off);
00132 }
00133 
00142 #ifdef MAVLINK_USE_CONVENIENCE_FUNCTIONS
00143 
00144 static inline void mavlink_msg_data_stream_send(mavlink_channel_t chan, uint8_t stream_id, uint16_t message_rate, uint8_t on_off)
00145 {
00146 #if MAVLINK_NEED_BYTE_SWAP || !MAVLINK_ALIGNED_FIELDS
00147         char buf[MAVLINK_MSG_ID_DATA_STREAM_LEN];
00148         _mav_put_uint16_t(buf, 0, message_rate);
00149         _mav_put_uint8_t(buf, 2, stream_id);
00150         _mav_put_uint8_t(buf, 3, on_off);
00151 
00152 #if MAVLINK_CRC_EXTRA
00153     _mav_finalize_message_chan_send(chan, MAVLINK_MSG_ID_DATA_STREAM, buf, MAVLINK_MSG_ID_DATA_STREAM_LEN, MAVLINK_MSG_ID_DATA_STREAM_CRC);
00154 #else
00155     _mav_finalize_message_chan_send(chan, MAVLINK_MSG_ID_DATA_STREAM, buf, MAVLINK_MSG_ID_DATA_STREAM_LEN);
00156 #endif
00157 #else
00158         mavlink_data_stream_t packet;
00159         packet.message_rate = message_rate;
00160         packet.stream_id = stream_id;
00161         packet.on_off = on_off;
00162 
00163 #if MAVLINK_CRC_EXTRA
00164     _mav_finalize_message_chan_send(chan, MAVLINK_MSG_ID_DATA_STREAM, (const char *)&packet, MAVLINK_MSG_ID_DATA_STREAM_LEN, MAVLINK_MSG_ID_DATA_STREAM_CRC);
00165 #else
00166     _mav_finalize_message_chan_send(chan, MAVLINK_MSG_ID_DATA_STREAM, (const char *)&packet, MAVLINK_MSG_ID_DATA_STREAM_LEN);
00167 #endif
00168 #endif
00169 }
00170 
00171 #if MAVLINK_MSG_ID_DATA_STREAM_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_data_stream_send_buf(mavlink_message_t *msgbuf, mavlink_channel_t chan,  uint8_t stream_id, uint16_t message_rate, uint8_t on_off)
00180 {
00181 #if MAVLINK_NEED_BYTE_SWAP || !MAVLINK_ALIGNED_FIELDS
00182         char *buf = (char *)msgbuf;
00183         _mav_put_uint16_t(buf, 0, message_rate);
00184         _mav_put_uint8_t(buf, 2, stream_id);
00185         _mav_put_uint8_t(buf, 3, on_off);
00186 
00187 #if MAVLINK_CRC_EXTRA
00188     _mav_finalize_message_chan_send(chan, MAVLINK_MSG_ID_DATA_STREAM, buf, MAVLINK_MSG_ID_DATA_STREAM_LEN, MAVLINK_MSG_ID_DATA_STREAM_CRC);
00189 #else
00190     _mav_finalize_message_chan_send(chan, MAVLINK_MSG_ID_DATA_STREAM, buf, MAVLINK_MSG_ID_DATA_STREAM_LEN);
00191 #endif
00192 #else
00193         mavlink_data_stream_t *packet = (mavlink_data_stream_t *)msgbuf;
00194         packet->message_rate = message_rate;
00195         packet->stream_id = stream_id;
00196         packet->on_off = on_off;
00197 
00198 #if MAVLINK_CRC_EXTRA
00199     _mav_finalize_message_chan_send(chan, MAVLINK_MSG_ID_DATA_STREAM, (const char *)packet, MAVLINK_MSG_ID_DATA_STREAM_LEN, MAVLINK_MSG_ID_DATA_STREAM_CRC);
00200 #else
00201     _mav_finalize_message_chan_send(chan, MAVLINK_MSG_ID_DATA_STREAM, (const char *)packet, MAVLINK_MSG_ID_DATA_STREAM_LEN);
00202 #endif
00203 #endif
00204 }
00205 #endif
00206 
00207 #endif
00208 
00209 // MESSAGE DATA_STREAM UNPACKING
00210 
00211 
00217 static inline uint8_t mavlink_msg_data_stream_get_stream_id(const mavlink_message_t* msg)
00218 {
00219         return _MAV_RETURN_uint8_t(msg,  2);
00220 }
00221 
00227 static inline uint16_t mavlink_msg_data_stream_get_message_rate(const mavlink_message_t* msg)
00228 {
00229         return _MAV_RETURN_uint16_t(msg,  0);
00230 }
00231 
00237 static inline uint8_t mavlink_msg_data_stream_get_on_off(const mavlink_message_t* msg)
00238 {
00239         return _MAV_RETURN_uint8_t(msg,  3);
00240 }
00241 
00248 static inline void mavlink_msg_data_stream_decode(const mavlink_message_t* msg, mavlink_data_stream_t* data_stream)
00249 {
00250 #if MAVLINK_NEED_BYTE_SWAP
00251         data_stream->message_rate = mavlink_msg_data_stream_get_message_rate(msg);
00252         data_stream->stream_id = mavlink_msg_data_stream_get_stream_id(msg);
00253         data_stream->on_off = mavlink_msg_data_stream_get_on_off(msg);
00254 #else
00255         memcpy(data_stream, _MAV_PAYLOAD(msg), MAVLINK_MSG_ID_DATA_STREAM_LEN);
00256 #endif
00257 }


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