aboutsummaryrefslogtreecommitdiff
path: root/thirdparty/nRF5_SDK_15.0.0_a53641a/components/serialization/common/struct_ser
diff options
context:
space:
mode:
Diffstat (limited to 'thirdparty/nRF5_SDK_15.0.0_a53641a/components/serialization/common/struct_ser')
-rw-r--r--thirdparty/nRF5_SDK_15.0.0_a53641a/components/serialization/common/struct_ser/ant/ant_struct_serialization.c159
-rw-r--r--thirdparty/nRF5_SDK_15.0.0_a53641a/components/serialization/common/struct_ser/ant/ant_struct_serialization.h110
-rw-r--r--thirdparty/nRF5_SDK_15.0.0_a53641a/components/serialization/common/struct_ser/ble/ble_gap_struct_serialization.c1749
-rw-r--r--thirdparty/nRF5_SDK_15.0.0_a53641a/components/serialization/common/struct_ser/ble/ble_gap_struct_serialization.h612
-rw-r--r--thirdparty/nRF5_SDK_15.0.0_a53641a/components/serialization/common/struct_ser/ble/ble_gatt_struct_serialization.c158
-rw-r--r--thirdparty/nRF5_SDK_15.0.0_a53641a/components/serialization/common/struct_ser/ble/ble_gatt_struct_serialization.h94
-rw-r--r--thirdparty/nRF5_SDK_15.0.0_a53641a/components/serialization/common/struct_ser/ble/ble_gattc_struct_serialization.c715
-rw-r--r--thirdparty/nRF5_SDK_15.0.0_a53641a/components/serialization/common/struct_ser/ble/ble_gattc_struct_serialization.h293
-rw-r--r--thirdparty/nRF5_SDK_15.0.0_a53641a/components/serialization/common/struct_ser/ble/ble_gatts_struct_serialization.c689
-rw-r--r--thirdparty/nRF5_SDK_15.0.0_a53641a/components/serialization/common/struct_ser/ble/ble_gatts_struct_serialization.h259
-rw-r--r--thirdparty/nRF5_SDK_15.0.0_a53641a/components/serialization/common/struct_ser/ble/ble_l2cap_struct_serialization.c227
-rw-r--r--thirdparty/nRF5_SDK_15.0.0_a53641a/components/serialization/common/struct_ser/ble/ble_l2cap_struct_serialization.h119
-rw-r--r--thirdparty/nRF5_SDK_15.0.0_a53641a/components/serialization/common/struct_ser/ble/ble_struct_serialization.c500
-rw-r--r--thirdparty/nRF5_SDK_15.0.0_a53641a/components/serialization/common/struct_ser/ble/ble_struct_serialization.h217
-rw-r--r--thirdparty/nRF5_SDK_15.0.0_a53641a/components/serialization/common/struct_ser/ble/nrf_soc_struct_serialization.c90
-rw-r--r--thirdparty/nRF5_SDK_15.0.0_a53641a/components/serialization/common/struct_ser/ble/nrf_soc_struct_serialization.h73
16 files changed, 6064 insertions, 0 deletions
diff --git a/thirdparty/nRF5_SDK_15.0.0_a53641a/components/serialization/common/struct_ser/ant/ant_struct_serialization.c b/thirdparty/nRF5_SDK_15.0.0_a53641a/components/serialization/common/struct_ser/ant/ant_struct_serialization.c
new file mode 100644
index 0000000..c0129b3
--- /dev/null
+++ b/thirdparty/nRF5_SDK_15.0.0_a53641a/components/serialization/common/struct_ser/ant/ant_struct_serialization.c
@@ -0,0 +1,159 @@
+/**
+ * Copyright (c) 2017 - 2018, Nordic Semiconductor ASA
+ *
+ * All rights reserved.
+ *
+ * Redistribution and use in source and binary forms, with or without modification,
+ * are permitted provided that the following conditions are met:
+ *
+ * 1. Redistributions of source code must retain the above copyright notice, this
+ * list of conditions and the following disclaimer.
+ *
+ * 2. Redistributions in binary form, except as embedded into a Nordic
+ * Semiconductor ASA integrated circuit in a product or a software update for
+ * such product, must reproduce the above copyright notice, this list of
+ * conditions and the following disclaimer in the documentation and/or other
+ * materials provided with the distribution.
+ *
+ * 3. Neither the name of Nordic Semiconductor ASA nor the names of its
+ * contributors may be used to endorse or promote products derived from this
+ * software without specific prior written permission.
+ *
+ * 4. This software, with or without modification, must only be used with a
+ * Nordic Semiconductor ASA integrated circuit.
+ *
+ * 5. Any software provided in binary form under this license must not be reverse
+ * engineered, decompiled, modified and/or disassembled.
+ *
+ * THIS SOFTWARE IS PROVIDED BY NORDIC SEMICONDUCTOR ASA "AS IS" AND ANY EXPRESS
+ * OR IMPLIED WARRANTIES, INCLUDING, BUT NOT LIMITED TO, THE IMPLIED WARRANTIES
+ * OF MERCHANTABILITY, NONINFRINGEMENT, AND FITNESS FOR A PARTICULAR PURPOSE ARE
+ * DISCLAIMED. IN NO EVENT SHALL NORDIC SEMICONDUCTOR ASA OR CONTRIBUTORS BE
+ * LIABLE FOR ANY DIRECT, INDIRECT, INCIDENTAL, SPECIAL, EXEMPLARY, OR
+ * CONSEQUENTIAL DAMAGES (INCLUDING, BUT NOT LIMITED TO, PROCUREMENT OF SUBSTITUTE
+ * GOODS OR SERVICES; LOSS OF USE, DATA, OR PROFITS; OR BUSINESS INTERRUPTION)
+ * HOWEVER CAUSED AND ON ANY THEORY OF LIABILITY, WHETHER IN CONTRACT, STRICT
+ * LIABILITY, OR TORT (INCLUDING NEGLIGENCE OR OTHERWISE) ARISING IN ANY WAY OUT
+ * OF THE USE OF THIS SOFTWARE, EVEN IF ADVISED OF THE POSSIBILITY OF SUCH DAMAGE.
+ *
+ */
+
+#include "ant_interface.h"
+#include "ant_struct_serialization.h"
+#include "nrf_sdh_ant.h"
+#include "ble_serialization.h"
+#include "app_util.h"
+#include "cond_field_serialization.h"
+#include <string.h>
+
+
+uint32_t ANT_ENABLE_enc(void const * const p_void_enable_params,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_ASSERT_NOT_NULL(p_buf);
+ SER_ASSERT_NOT_NULL(p_index);
+ SER_ASSERT_NOT_NULL(p_void_enable_params);
+
+ ANT_ENABLE * p_enable_params = (ANT_ENABLE *)p_void_enable_params;
+ uint32_t err_code = NRF_SUCCESS;
+
+ err_code = uint8_t_enc(&p_enable_params->ucTotalNumberOfChannels, p_buf, buf_len, p_index);
+ SER_ASSERT(err_code == NRF_SUCCESS, err_code);
+
+ err_code = uint8_t_enc(&p_enable_params->ucNumberOfEncryptedChannels, p_buf, buf_len, p_index);
+ SER_ASSERT(err_code == NRF_SUCCESS, err_code);
+
+ err_code = uint16_t_enc(&p_enable_params->usNumberOfEvents, p_buf, buf_len, p_index);
+ SER_ASSERT(err_code == NRF_SUCCESS, err_code);
+
+ err_code = uint32_t_enc(&p_enable_params->pucMemoryBlockStartLocation, p_buf, buf_len, p_index);
+ SER_ASSERT(err_code == NRF_SUCCESS, err_code);
+
+ err_code = uint16_t_enc(&p_enable_params->usMemoryBlockByteSize, p_buf, buf_len, p_index);
+ SER_ASSERT(err_code == NRF_SUCCESS, err_code);
+
+ return err_code;
+}
+
+
+uint32_t ANT_ENABLE_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_enable_params)
+
+{
+ SER_ASSERT_NOT_NULL(p_buf);
+ SER_ASSERT_NOT_NULL(p_index);
+ SER_ASSERT_NOT_NULL(p_void_enable_params);
+
+ ANT_ENABLE * p_enable_params = (ANT_ENABLE *)p_void_enable_params;
+ uint32_t err_code = NRF_SUCCESS;
+
+ err_code = uint8_t_dec(p_buf, buf_len, p_index, &p_enable_params->ucTotalNumberOfChannels);
+ SER_ASSERT(err_code == NRF_SUCCESS, err_code);
+
+ err_code = uint8_t_dec(p_buf, buf_len, p_index, &p_enable_params->ucNumberOfEncryptedChannels);
+ SER_ASSERT(err_code == NRF_SUCCESS, err_code);
+
+ err_code = uint16_t_dec(p_buf, buf_len, p_index, &p_enable_params->usNumberOfEvents);
+ SER_ASSERT(err_code == NRF_SUCCESS, err_code);
+
+ err_code = uint32_t_dec(p_buf, buf_len, p_index, &p_enable_params->pucMemoryBlockStartLocation);
+ SER_ASSERT(err_code == NRF_SUCCESS, err_code);
+
+ err_code = uint16_t_dec(p_buf, buf_len, p_index, &p_enable_params->usMemoryBlockByteSize);
+ SER_ASSERT(err_code == NRF_SUCCESS, err_code);
+
+ return err_code;
+}
+
+uint32_t ant_evt_t_enc(void const * const p_void_ant_evt,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_ASSERT_NOT_NULL(p_buf);
+ SER_ASSERT_NOT_NULL(p_index);
+ SER_ASSERT_NOT_NULL(p_void_ant_evt);
+
+ ant_evt_t * p_ant_evt = (ant_evt_t *)p_void_ant_evt;
+ uint32_t err_code = NRF_SUCCESS;
+
+ memcpy(&p_buf[*p_index], p_ant_evt->message.aucMessage, MESG_BUFFER_SIZE); // Size + sizeof(size) & sizeof(msg id)
+ *p_index += MESG_BUFFER_SIZE;
+
+ err_code = uint8_t_enc(&p_ant_evt->event, p_buf, buf_len, p_index);
+ SER_ASSERT(err_code == NRF_SUCCESS, err_code);
+
+ err_code = uint8_t_enc(&p_ant_evt->channel, p_buf, buf_len, p_index);
+ SER_ASSERT(err_code == NRF_SUCCESS, err_code);
+
+ return(err_code);
+}
+
+uint32_t ant_evt_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_ant_evt)
+
+{
+ SER_ASSERT_NOT_NULL(p_buf);
+ SER_ASSERT_NOT_NULL(p_index);
+ SER_ASSERT_NOT_NULL(p_void_ant_evt);
+
+ ant_evt_t * p_ant_evt = (ant_evt_t *)p_void_ant_evt;
+ uint32_t err_code = NRF_SUCCESS;
+
+ memcpy(p_ant_evt->message.aucMessage, &p_buf[*p_index], MESG_BUFFER_SIZE); // Size + sizeof(size) & sizeof(msg id)
+ *p_index += MESG_BUFFER_SIZE;
+
+ err_code = uint8_t_dec(p_buf, buf_len, p_index, &p_ant_evt->event);
+ SER_ASSERT(err_code == NRF_SUCCESS, err_code);
+
+ err_code = uint8_t_dec(p_buf, buf_len, p_index, &p_ant_evt->channel);
+ SER_ASSERT(err_code == NRF_SUCCESS, err_code);
+
+ return err_code;
+}
diff --git a/thirdparty/nRF5_SDK_15.0.0_a53641a/components/serialization/common/struct_ser/ant/ant_struct_serialization.h b/thirdparty/nRF5_SDK_15.0.0_a53641a/components/serialization/common/struct_ser/ant/ant_struct_serialization.h
new file mode 100644
index 0000000..8f405fa
--- /dev/null
+++ b/thirdparty/nRF5_SDK_15.0.0_a53641a/components/serialization/common/struct_ser/ant/ant_struct_serialization.h
@@ -0,0 +1,110 @@
+/**
+ * Copyright (c) 2017 - 2018, Nordic Semiconductor ASA
+ *
+ * All rights reserved.
+ *
+ * Redistribution and use in source and binary forms, with or without modification,
+ * are permitted provided that the following conditions are met:
+ *
+ * 1. Redistributions of source code must retain the above copyright notice, this
+ * list of conditions and the following disclaimer.
+ *
+ * 2. Redistributions in binary form, except as embedded into a Nordic
+ * Semiconductor ASA integrated circuit in a product or a software update for
+ * such product, must reproduce the above copyright notice, this list of
+ * conditions and the following disclaimer in the documentation and/or other
+ * materials provided with the distribution.
+ *
+ * 3. Neither the name of Nordic Semiconductor ASA nor the names of its
+ * contributors may be used to endorse or promote products derived from this
+ * software without specific prior written permission.
+ *
+ * 4. This software, with or without modification, must only be used with a
+ * Nordic Semiconductor ASA integrated circuit.
+ *
+ * 5. Any software provided in binary form under this license must not be reverse
+ * engineered, decompiled, modified and/or disassembled.
+ *
+ * THIS SOFTWARE IS PROVIDED BY NORDIC SEMICONDUCTOR ASA "AS IS" AND ANY EXPRESS
+ * OR IMPLIED WARRANTIES, INCLUDING, BUT NOT LIMITED TO, THE IMPLIED WARRANTIES
+ * OF MERCHANTABILITY, NONINFRINGEMENT, AND FITNESS FOR A PARTICULAR PURPOSE ARE
+ * DISCLAIMED. IN NO EVENT SHALL NORDIC SEMICONDUCTOR ASA OR CONTRIBUTORS BE
+ * LIABLE FOR ANY DIRECT, INDIRECT, INCIDENTAL, SPECIAL, EXEMPLARY, OR
+ * CONSEQUENTIAL DAMAGES (INCLUDING, BUT NOT LIMITED TO, PROCUREMENT OF SUBSTITUTE
+ * GOODS OR SERVICES; LOSS OF USE, DATA, OR PROFITS; OR BUSINESS INTERRUPTION)
+ * HOWEVER CAUSED AND ON ANY THEORY OF LIABILITY, WHETHER IN CONTRACT, STRICT
+ * LIABILITY, OR TORT (INCLUDING NEGLIGENCE OR OTHERWISE) ARISING IN ANY WAY OUT
+ * OF THE USE OF THIS SOFTWARE, EVEN IF ADVISED OF THE POSSIBILITY OF SUCH DAMAGE.
+ *
+ */
+
+#ifndef _ANT_STRUCT_SERIALIZATION_
+#define _ANT_STRUCT_SERIALIZATION_
+
+/**@brief Function for safe encoding of an ANT_ENABLE struct.
+ *
+ * Safe decoding of an ANT_ENABLE struct. Range checks will be done if @ref SER_ASSERTS_ENABLED is set.
+ *
+ * @param[in] p_void_enable_params An ANT_ENABLE struct to be encoded.
+ * @param[out] p_buf Buffer containing the struct.
+ * @param[in] buf_len Size of the buffer.
+ * @param[in,out] p_index \c in: Index to the start of the ANT_ENABLE struct in the buffer.
+ * \c out: Index in the buffer to the first byte after the decoded struct.
+ *
+ * @return NRF_SUCCESS Fields decoded successfully.
+ * @retval NRF_ERROR_INVALID_LENGTH Decoding failure. Incorrect buffer length.
+ */
+uint32_t ANT_ENABLE_enc( void const * const p_void_enable_params,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+/**@brief Function for safe decoding of an ANT_ENABLE struct.
+ *
+ * Safe decoding of a ANT_ENABLE struct. Range checks will be done if @ref SER_ASSERTS_ENABLED is set.
+ *
+ * @param[in] p_buf Buffer containing the struct.
+ * @param[in] buf_len Size of the buffer.
+ * @param[in,out] p_index \c in: Index to the start of the ANT_ENABLE struct in the buffer.
+ * \c out: Index in the buffer to the first byte after the decoded struct.
+ * @param[out] p_void_enable_params Decoded ANT_ENABLE struct.
+ */
+uint32_t ANT_ENABLE_dec( uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_enable_params);
+
+/**@brief Function for safe encoding of an ant_evt_t struct.
+ *
+ * Safe decoding of an ant_evt_t struct. Range checks will be done if @ref SER_ASSERTS_ENABLED is set.
+ *
+ * @param[in] p_void_ant_evt An ant_evt_t struct to be encoded.
+ * @param[out] p_buf Buffer containing the struct.
+ * @param[in] buf_len Size of the buffer.
+ * @param[in,out] p_index \c in: Index to the start of the ant_evt_t struct in the buffer.
+ * \c out: Index in the buffer to the first byte after the decoded struct.
+ *
+ * @return NRF_SUCCESS Fields decoded successfully.
+ * @retval NRF_ERROR_INVALID_LENGTH Decoding failure. Incorrect buffer length.
+ */
+uint32_t ant_evt_t_enc( void const * const p_void_ant_evt,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+/**@brief Function for safe decoding of an ant_evt_t struct.
+ *
+ * Safe decoding of a ant_evt_t struct. Range checks will be done if @ref SER_ASSERTS_ENABLED is set.
+ *
+ * @param[in] p_buf Buffer containing the struct.
+ * @param[in] buf_len Size of the buffer.
+ * @param[in,out] p_index \c in: Index to the start of the ant_evt_t struct in the buffer.
+ * \c out: Index in the buffer to the first byte after the decoded struct.
+ * @param[out] p_void_ant_evt Decoded ant_evt_t struct.
+ */
+uint32_t ant_evt_t_dec( uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_ant_evt);
+
+#endif
diff --git a/thirdparty/nRF5_SDK_15.0.0_a53641a/components/serialization/common/struct_ser/ble/ble_gap_struct_serialization.c b/thirdparty/nRF5_SDK_15.0.0_a53641a/components/serialization/common/struct_ser/ble/ble_gap_struct_serialization.c
new file mode 100644
index 0000000..9071ad7
--- /dev/null
+++ b/thirdparty/nRF5_SDK_15.0.0_a53641a/components/serialization/common/struct_ser/ble/ble_gap_struct_serialization.c
@@ -0,0 +1,1749 @@
+/**
+ * Copyright (c) 2014 - 2018, Nordic Semiconductor ASA
+ *
+ * All rights reserved.
+ *
+ * Redistribution and use in source and binary forms, with or without modification,
+ * are permitted provided that the following conditions are met:
+ *
+ * 1. Redistributions of source code must retain the above copyright notice, this
+ * list of conditions and the following disclaimer.
+ *
+ * 2. Redistributions in binary form, except as embedded into a Nordic
+ * Semiconductor ASA integrated circuit in a product or a software update for
+ * such product, must reproduce the above copyright notice, this list of
+ * conditions and the following disclaimer in the documentation and/or other
+ * materials provided with the distribution.
+ *
+ * 3. Neither the name of Nordic Semiconductor ASA nor the names of its
+ * contributors may be used to endorse or promote products derived from this
+ * software without specific prior written permission.
+ *
+ * 4. This software, with or without modification, must only be used with a
+ * Nordic Semiconductor ASA integrated circuit.
+ *
+ * 5. Any software provided in binary form under this license must not be reverse
+ * engineered, decompiled, modified and/or disassembled.
+ *
+ * THIS SOFTWARE IS PROVIDED BY NORDIC SEMICONDUCTOR ASA "AS IS" AND ANY EXPRESS
+ * OR IMPLIED WARRANTIES, INCLUDING, BUT NOT LIMITED TO, THE IMPLIED WARRANTIES
+ * OF MERCHANTABILITY, NONINFRINGEMENT, AND FITNESS FOR A PARTICULAR PURPOSE ARE
+ * DISCLAIMED. IN NO EVENT SHALL NORDIC SEMICONDUCTOR ASA OR CONTRIBUTORS BE
+ * LIABLE FOR ANY DIRECT, INDIRECT, INCIDENTAL, SPECIAL, EXEMPLARY, OR
+ * CONSEQUENTIAL DAMAGES (INCLUDING, BUT NOT LIMITED TO, PROCUREMENT OF SUBSTITUTE
+ * GOODS OR SERVICES; LOSS OF USE, DATA, OR PROFITS; OR BUSINESS INTERRUPTION)
+ * HOWEVER CAUSED AND ON ANY THEORY OF LIABILITY, WHETHER IN CONTRACT, STRICT
+ * LIABILITY, OR TORT (INCLUDING NEGLIGENCE OR OTHERWISE) ARISING IN ANY WAY OUT
+ * OF THE USE OF THIS SOFTWARE, EVEN IF ADVISED OF THE POSSIBILITY OF SUCH DAMAGE.
+ *
+ */
+#include "ble_gap_struct_serialization.h"
+#include "ble_struct_serialization.h"
+#include "ble_serialization.h"
+#include "cond_field_serialization.h"
+#include "app_util.h"
+#include "string.h"
+#include "ble_gatts.h"
+
+#ifndef S112
+uint32_t ble_gap_evt_adv_report_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gap_evt_adv_report_t);
+#if NRF_SD_BLE_API_VERSION > 5
+ SER_PUSH_FIELD(&p_struct->type, ble_gap_adv_report_type_t_enc);
+ SER_PUSH_FIELD(&p_struct->peer_addr, ble_gap_addr_t_enc);
+ SER_PUSH_FIELD(&p_struct->direct_addr, ble_gap_addr_t_enc);
+ SER_PUSH_uint8(&p_struct->primary_phy);
+ SER_PUSH_uint8(&p_struct->secondary_phy);
+ SER_PUSH_int8(&p_struct->tx_power);
+ SER_PUSH_int8(&p_struct->rssi);
+ SER_PUSH_uint8(&p_struct->ch_index);
+ SER_PUSH_uint8(&p_struct->set_id);
+ uint16_t temp = p_struct->data_id;
+ SER_PUSH_uint16(&temp);
+ SER_PUSH_FIELD(&p_struct->data, ble_data_t_enc);
+ SER_PUSH_FIELD(&p_struct->aux_pointer, ble_gap_aux_pointer_t_enc);
+#else
+ uint8_t ser_data = (p_struct->scan_rsp & 0x01)
+ | ((p_struct->type & 0x03) << 1);
+ uint8_t data_len = (p_struct->dlen & 0x1F);
+ SER_PUSH_FIELD(&p_struct->peer_addr, ble_gap_addr_t_enc);
+ SER_PUSH_FIELD(&p_struct->direct_addr, ble_gap_addr_t_enc);
+ SER_PUSH_int8(&p_struct->rssi);
+ SER_PUSH_uint8(&ser_data);
+ SER_PUSH_len8data(p_struct->data, data_len);
+#endif
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gap_evt_adv_report_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gap_evt_adv_report_t);
+
+#if NRF_SD_BLE_API_VERSION > 5
+ SER_PULL_FIELD(&p_struct->type, ble_gap_adv_report_type_t_dec);
+ SER_PULL_FIELD(&p_struct->peer_addr, ble_gap_addr_t_dec);
+ SER_PULL_FIELD(&p_struct->direct_addr, ble_gap_addr_t_dec);
+ SER_PULL_uint8(&p_struct->primary_phy);
+ SER_PULL_uint8(&p_struct->secondary_phy);
+ SER_PULL_int8(&p_struct->tx_power);
+ SER_PULL_int8(&p_struct->rssi);
+ SER_PULL_uint8(&p_struct->ch_index);
+ SER_PULL_uint8(&p_struct->set_id);
+ uint16_t temp;
+ SER_PULL_uint16(&temp);
+ p_struct->data_id = temp & 0x0FFF;
+ SER_PULL_FIELD(&p_struct->data, ble_data_t_dec);
+ SER_PULL_FIELD(&p_struct->aux_pointer, ble_gap_aux_pointer_t_dec);
+#else
+ uint8_t ser_data;
+ uint8_t data_len = BLE_GAP_ADV_MAX_SIZE;
+ uint8_t * p_field_data = p_struct->data;
+ SER_PULL_FIELD(&p_struct->peer_addr, ble_gap_addr_t_dec);
+ SER_PULL_FIELD(&p_struct->direct_addr, ble_gap_addr_t_dec);
+ SER_PULL_int8(&p_struct->rssi);
+ SER_PULL_uint8(&ser_data);
+ SER_PULL_len8data(&p_field_data, &data_len);
+
+ p_struct->scan_rsp = ser_data & 0x01;
+ p_struct->type = (ser_data >> 1) & 0x03;
+ p_struct->dlen = data_len;
+#endif
+ SER_STRUCT_DEC_END;
+}
+#endif
+
+uint32_t ble_gap_irk_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gap_irk_t);
+ SER_PUSH_uint8array(p_struct->irk, BLE_GAP_SEC_KEY_LEN);
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gap_irk_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gap_irk_t);
+ SER_PULL_uint8array(p_struct->irk, BLE_GAP_SEC_KEY_LEN);
+ SER_STRUCT_DEC_END;
+}
+
+uint32_t ble_gap_addr_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gap_addr_t);
+
+ uint8_t ser_data = (p_struct->addr_id_peer & 0x01)
+ | ((p_struct->addr_type & 0x7F) << 1);
+ SER_PUSH_uint8(&ser_data);
+ SER_PUSH_uint8array(p_struct->addr, BLE_GAP_ADDR_LEN);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gap_addr_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gap_addr_t);
+
+ uint8_t ser_data;
+ SER_PULL_uint8(&ser_data);
+ SER_PULL_uint8array(p_struct->addr, BLE_GAP_ADDR_LEN);
+
+ p_struct->addr_id_peer = ser_data & 0x01;
+ p_struct->addr_type = (ser_data >> 1) & 0x7F;
+
+ SER_STRUCT_DEC_END;
+}
+
+uint32_t ble_gap_sec_levels_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gap_sec_levels_t);
+
+ uint8_t sec_levels_serialized = (p_struct->lv1 << 0) | (p_struct->lv2 << 1)
+ | (p_struct->lv3 << 2) | (p_struct->lv4 << 3);
+ SER_PUSH_uint8(&sec_levels_serialized);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gap_sec_levels_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gap_sec_levels_t);
+
+ uint32_t sec_levels_serialized;
+ SER_PULL_uint8(&sec_levels_serialized);
+
+ p_struct->lv1 = sec_levels_serialized & 0x01;
+ p_struct->lv2 = (sec_levels_serialized >> 1) & 0x01;
+ p_struct->lv3 = (sec_levels_serialized >> 2) & 0x01;
+ p_struct->lv4 = (sec_levels_serialized >> 3) & 0x01;
+
+ SER_STRUCT_DEC_END;
+}
+
+uint32_t ble_gap_sec_keys_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gap_sec_keys_t);
+
+ SER_PUSH_COND(p_struct->p_enc_key, ble_gap_enc_key_t_enc);
+ SER_PUSH_COND(p_struct->p_id_key, ble_gap_id_key_t_enc);
+ SER_PUSH_COND(p_struct->p_sign_key, ble_gap_sign_info_t_enc);
+ SER_PUSH_COND(p_struct->p_pk, ble_gap_lesc_p256_pk_t_enc);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gap_sec_keys_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gap_sec_keys_t);
+
+ SER_PULL_COND(&(p_struct->p_enc_key), ble_gap_enc_key_t_dec);
+ SER_PULL_COND(&(p_struct->p_id_key), ble_gap_id_key_t_dec);
+ SER_PULL_COND(&(p_struct->p_sign_key), ble_gap_sign_info_t_dec);
+ SER_PULL_COND(&(p_struct->p_pk), ble_gap_lesc_p256_pk_t_dec);
+
+ SER_STRUCT_DEC_END;
+}
+
+uint32_t ble_gap_enc_info_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gap_enc_info_t);
+
+ SER_PUSH_uint8array(p_struct->ltk, BLE_GAP_SEC_KEY_LEN);
+ uint8_t ser_data = (p_struct->lesc & 0x01)
+ | ((p_struct->auth & 0x01) << 1)
+ | ((p_struct->ltk_len & 0x3F) << 2);
+ SER_PUSH_uint8(&ser_data);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gap_enc_info_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gap_enc_info_t);
+
+ uint8_t ser_data;
+ SER_PULL_uint8array(p_struct->ltk, BLE_GAP_SEC_KEY_LEN);
+ SER_PULL_uint8(&ser_data);
+ p_struct->lesc = ser_data & 0x01;
+ p_struct->auth = (ser_data >> 1) & 0x01;
+ p_struct->ltk_len = (ser_data >> 2) & 0x3F;
+
+ SER_STRUCT_DEC_END;
+}
+
+uint32_t ble_gap_sign_info_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gap_sign_info_t);
+ SER_PUSH_uint8array(p_struct->csrk, BLE_GAP_SEC_KEY_LEN);
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gap_sign_info_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gap_sign_info_t);
+ SER_PULL_uint8array(p_struct->csrk, BLE_GAP_SEC_KEY_LEN);
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gap_evt_auth_status_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gap_evt_auth_status_t);
+ uint8_t ser_data = (p_struct->error_src) | ((p_struct->bonded) << 2);
+#if NRF_SD_BLE_API_VERSION >= 5
+ ser_data |= ((p_struct->lesc) << 3);
+#endif
+ SER_PUSH_uint8(&(p_struct->auth_status));
+ SER_PUSH_uint8(&ser_data);
+
+ SER_PUSH_FIELD(&(p_struct->sm1_levels), ble_gap_sec_levels_t_enc);
+ SER_PUSH_FIELD(&(p_struct->sm2_levels), ble_gap_sec_levels_t_enc);
+ SER_PUSH_FIELD(&(p_struct->kdist_own), ble_gap_sec_kdist_t_enc);
+ SER_PUSH_FIELD(&(p_struct->kdist_peer), ble_gap_sec_kdist_t_enc);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gap_evt_auth_status_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gap_evt_auth_status_t);
+
+ uint8_t ser_data;
+ SER_PULL_uint8(&(p_struct->auth_status));
+ SER_PULL_uint8(&ser_data);
+ p_struct->error_src = ser_data & 0x03;
+ p_struct->bonded = (ser_data >> 2) & 0x01;
+#if NRF_SD_BLE_API_VERSION >= 5
+ p_struct->lesc = (ser_data >> 3) & 0x01;
+#endif
+
+ SER_PULL_FIELD(&(p_struct->sm1_levels), ble_gap_sec_levels_t_dec);
+ SER_PULL_FIELD(&(p_struct->sm2_levels), ble_gap_sec_levels_t_dec);
+ SER_PULL_FIELD(&(p_struct->kdist_own), ble_gap_sec_kdist_t_dec);
+ SER_PULL_FIELD(&(p_struct->kdist_peer), ble_gap_sec_kdist_t_dec);
+
+ SER_STRUCT_DEC_END;
+}
+
+
+uint32_t ble_gap_conn_sec_mode_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gap_conn_sec_mode_t);
+
+ uint8_t ser_data = (p_struct->sm & 0x0F)
+ | ((p_struct->lv & 0x0F) << 4);
+ SER_PUSH_uint8(&ser_data);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gap_conn_sec_mode_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gap_conn_sec_mode_t);
+
+ uint8_t ser_data;
+ SER_PULL_uint8(&ser_data);
+ p_struct->sm = ser_data & 0x0F;
+ p_struct->lv = (ser_data >> 4) & 0x0F;
+
+ SER_STRUCT_DEC_END;
+}
+
+uint32_t ble_gap_evt_conn_sec_update_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gap_evt_conn_sec_update_t);
+ SER_PUSH_FIELD(&(p_struct->conn_sec), ble_gap_conn_sec_t_enc);
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gap_evt_conn_sec_update_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gap_evt_conn_sec_update_t);
+ SER_PULL_FIELD(&(p_struct->conn_sec), ble_gap_conn_sec_t_dec);
+ SER_STRUCT_DEC_END;
+}
+
+uint32_t ble_gap_conn_sec_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gap_conn_sec_t);
+
+ SER_PUSH_FIELD(&p_struct->sec_mode, ble_gap_conn_sec_mode_t_enc);
+ SER_PUSH_uint8(&p_struct->encr_key_size);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gap_conn_sec_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gap_conn_sec_t);
+
+ SER_PULL_FIELD(&p_struct->sec_mode, ble_gap_conn_sec_mode_t_dec);
+ SER_PULL_uint8(&p_struct->encr_key_size);
+
+ SER_STRUCT_DEC_END;
+}
+
+uint32_t ble_gap_evt_sec_info_request_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gap_evt_sec_info_request_t);
+
+ uint8_t ser_data = (p_struct->enc_info & 0x01)
+ | ((p_struct->id_info & 0x01) << 1)
+ | ((p_struct->sign_info& 0x01) << 2);
+ SER_PUSH_FIELD(&p_struct->peer_addr, ble_gap_addr_t_enc);
+ SER_PUSH_FIELD(&p_struct->master_id, ble_gap_master_id_t_enc);
+ SER_PUSH_uint8(&ser_data);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gap_evt_sec_info_request_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gap_evt_sec_info_request_t);
+
+ uint8_t ser_data;
+ SER_PULL_FIELD(&p_struct->peer_addr, ble_gap_addr_t_dec);
+ SER_PULL_FIELD(&p_struct->master_id, ble_gap_master_id_t_dec);
+ SER_PULL_uint8(&ser_data);
+ p_struct->enc_info = ser_data & 0x01;
+ p_struct->id_info = (ser_data >> 1) & 0x01;
+ p_struct->sign_info = (ser_data >> 2) & 0x01;
+
+ SER_STRUCT_DEC_END;
+}
+
+uint32_t ble_gap_evt_connected_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gap_evt_connected_t);
+
+ SER_PUSH_FIELD(&p_struct->peer_addr, ble_gap_addr_t_enc);
+ SER_PUSH_uint8(&p_struct->role);
+ SER_PUSH_FIELD(&p_struct->conn_params, ble_gap_conn_params_t_enc);
+#if defined(NRF_SD_BLE_API_VERSION) && NRF_SD_BLE_API_VERSION > 5
+ SER_PUSH_uint8(&p_struct->adv_handle);
+ SER_PUSH_uint16(&p_struct->adv_data.adv_data.len);
+ SER_PUSH_uint16(&p_struct->adv_data.scan_rsp_data.len);
+#endif
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gap_evt_connected_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gap_evt_connected_t);
+
+ SER_PULL_FIELD(&p_struct->peer_addr, ble_gap_addr_t_dec);
+ SER_PULL_uint8(&p_struct->role);
+ SER_PULL_FIELD(&p_struct->conn_params, ble_gap_conn_params_t_dec);
+#if defined(NRF_SD_BLE_API_VERSION) && NRF_SD_BLE_API_VERSION > 5
+ SER_PULL_uint8(&p_struct->adv_handle);
+ SER_PULL_uint16(&p_struct->adv_data.adv_data.len);
+ SER_PULL_uint16(&p_struct->adv_data.scan_rsp_data.len);
+#endif
+
+ SER_STRUCT_DEC_END;
+}
+
+uint32_t ble_gap_sec_params_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gap_sec_params_t);
+
+ uint8_t ser_data = (p_struct->bond & 0x01)
+ | ((p_struct->mitm & 0x01) << 1)
+ | ((p_struct->lesc & 0x01) << 2)
+ | ((p_struct->keypress & 0x01) << 3)
+ | ((p_struct->io_caps & 0x07) << 4)
+ | ((p_struct->oob & 0x01) << 7);
+ SER_PUSH_uint8(&ser_data);
+ SER_PUSH_uint8(&p_struct->min_key_size);
+ SER_PUSH_uint8(&p_struct->max_key_size);
+ SER_PUSH_FIELD(&p_struct->kdist_own, ble_gap_sec_kdist_t_enc);
+ SER_PUSH_FIELD(&p_struct->kdist_peer, ble_gap_sec_kdist_t_enc);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gap_sec_params_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gap_sec_params_t);
+
+ uint8_t ser_data;
+ SER_PULL_uint8(&ser_data);
+ SER_PULL_uint8(&p_struct->min_key_size);
+ SER_PULL_uint8(&p_struct->max_key_size);
+ SER_PULL_FIELD(&p_struct->kdist_own, ble_gap_sec_kdist_t_dec);
+ SER_PULL_FIELD(&p_struct->kdist_peer, ble_gap_sec_kdist_t_dec);
+ p_struct->bond = ser_data & 0x01;
+ p_struct->mitm = (ser_data >> 1) & 0x01;
+ p_struct->lesc = (ser_data >> 2) & 0x01;
+ p_struct->keypress = (ser_data >> 3) & 0x01;
+ p_struct->io_caps = (ser_data >> 4) & 0x07;
+ p_struct->oob = (ser_data >> 7) & 0x01;
+
+ SER_STRUCT_DEC_END;
+}
+
+uint32_t ble_gap_evt_sec_params_request_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gap_evt_sec_params_request_t);
+ SER_PUSH_FIELD(&(p_struct->peer_params), ble_gap_sec_params_t_enc);
+ SER_STRUCT_ENC_END;
+}
+
+ uint32_t ble_gap_evt_sec_params_request_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gap_evt_sec_params_request_t);
+ SER_PULL_FIELD(&(p_struct->peer_params), ble_gap_sec_params_t_dec);
+ SER_STRUCT_DEC_END;
+}
+
+uint32_t ble_gap_evt_conn_param_update_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gap_evt_conn_param_update_t);
+ SER_PUSH_FIELD(&(p_struct->conn_params), ble_gap_conn_params_t_enc);
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gap_evt_conn_param_update_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gap_evt_conn_param_update_t);
+ SER_PULL_FIELD(&(p_struct->conn_params), ble_gap_conn_params_t_dec);
+ SER_STRUCT_DEC_END;
+}
+
+#ifndef S112
+uint32_t ble_gap_evt_conn_param_update_request_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gap_evt_conn_param_update_request_t);
+ SER_PUSH_FIELD(&(p_struct->conn_params), ble_gap_conn_params_t_enc);
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gap_evt_conn_param_update_request_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gap_evt_conn_param_update_request_t);
+ SER_PULL_FIELD(&(p_struct->conn_params), ble_gap_conn_params_t_dec);
+ SER_STRUCT_DEC_END;
+}
+#endif //!S112
+
+uint32_t ble_gap_conn_params_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gap_conn_params_t);
+
+ SER_PUSH_uint16(&p_struct->min_conn_interval);
+ SER_PUSH_uint16(&p_struct->max_conn_interval);
+ SER_PUSH_uint16(&p_struct->slave_latency);
+ SER_PUSH_uint16(&p_struct->conn_sup_timeout);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gap_conn_params_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gap_conn_params_t);
+
+ SER_PULL_uint16(&p_struct->min_conn_interval);
+ SER_PULL_uint16(&p_struct->max_conn_interval);
+ SER_PULL_uint16(&p_struct->slave_latency);
+ SER_PULL_uint16(&p_struct->conn_sup_timeout);
+
+ SER_STRUCT_DEC_END;
+}
+
+uint32_t ble_gap_evt_disconnected_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gap_evt_disconnected_t);
+ SER_PUSH_uint8(&p_struct->reason);
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gap_evt_disconnected_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gap_evt_disconnected_t);
+ SER_PULL_uint8(&p_struct->reason);
+ SER_STRUCT_DEC_END;
+}
+
+uint32_t ble_gap_master_id_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gap_master_id_t);
+ SER_PUSH_uint16(&p_struct->ediv);
+ SER_PUSH_uint8array(p_struct->rand, BLE_GAP_SEC_RAND_LEN);
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gap_master_id_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gap_master_id_t);
+ SER_PULL_uint16(&p_struct->ediv);
+ SER_PULL_uint8array(p_struct->rand, BLE_GAP_SEC_RAND_LEN);
+ SER_STRUCT_DEC_END;
+}
+
+#ifndef S112
+uint32_t ble_gap_scan_params_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gap_scan_params_t);
+ uint8_t ser_data;
+#if defined(NRF_SD_BLE_API_VERSION) && NRF_SD_BLE_API_VERSION < 6
+ ser_data = (p_struct->active & 0x01)
+ | ((p_struct->use_whitelist & 0x01) << 1)
+ | ((p_struct->adv_dir_report & 0x01) << 2);
+ SER_PUSH_uint8(&ser_data);
+#else
+ ser_data =
+ ((p_struct->extended & 0x01) << 0) |
+ ((p_struct->report_incomplete_evts & 0x01) << 1) |
+ ((p_struct->active & 0x01) << 2) |
+ ((p_struct->filter_policy & 0x03) << 3);
+ SER_PUSH_uint8(&ser_data);
+ SER_PUSH_uint8(&p_struct->scan_phys);
+ SER_PUSH_buf(p_struct->channel_mask, 5);
+#endif
+ SER_PUSH_uint16(&p_struct->interval);
+ SER_PUSH_uint16(&p_struct->window);
+ SER_PUSH_uint16(&p_struct->timeout);
+
+ SER_STRUCT_ENC_END;
+}
+uint32_t ble_gap_scan_params_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gap_scan_params_t);
+
+ uint8_t ser_data;
+#if defined(NRF_SD_BLE_API_VERSION) && NRF_SD_BLE_API_VERSION < 6
+ SER_PULL_uint8(&ser_data);
+ p_struct->active = ser_data & 0x01;
+ p_struct->use_whitelist = (ser_data >> 1) & 0x01;
+ p_struct->adv_dir_report = (ser_data >> 2) & 0x01;
+#else
+ SER_PULL_uint8(&ser_data);
+ p_struct->extended = ser_data & 0x01;
+ p_struct->report_incomplete_evts = (ser_data >> 1) & 0x01;
+ p_struct->active = (ser_data >> 2) & 0x01;
+ p_struct->filter_policy = (ser_data >> 3) & 0x03;
+
+ SER_PULL_uint8(&p_struct->scan_phys);
+ uint8_t * p_channel_mask = (uint8_t *)p_struct->channel_mask;
+ SER_PULL_buf(&p_channel_mask, 5, 5);
+#endif
+ SER_PULL_uint16(&p_struct->interval);
+ SER_PULL_uint16(&p_struct->window);
+ SER_PULL_uint16(&p_struct->timeout);
+
+ SER_STRUCT_DEC_END;
+}
+#endif //!S112
+
+uint32_t ble_gap_enc_key_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gap_enc_key_t);
+
+ SER_PUSH_FIELD(&p_struct->enc_info, ble_gap_enc_info_t_enc);
+ SER_PUSH_FIELD(&p_struct->master_id, ble_gap_master_id_t_enc);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gap_enc_key_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gap_enc_key_t);
+
+ SER_PULL_FIELD(&p_struct->enc_info, ble_gap_enc_info_t_dec);
+ SER_PULL_FIELD(&p_struct->master_id, ble_gap_master_id_t_dec);
+
+ SER_STRUCT_DEC_END;
+}
+
+uint32_t ble_gap_id_key_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gap_id_key_t);
+
+ SER_PUSH_FIELD(&p_struct->id_info, ble_gap_irk_t_enc);
+ SER_PUSH_FIELD(&p_struct->id_addr_info, ble_gap_addr_t_enc);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gap_id_key_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gap_id_key_t);
+
+ SER_PULL_FIELD(&p_struct->id_info, ble_gap_irk_t_dec);
+ SER_PULL_FIELD(&p_struct->id_addr_info, ble_gap_addr_t_dec);
+
+ SER_STRUCT_DEC_END;
+}
+
+uint32_t ble_gap_sec_keyset_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gap_sec_keyset_t);
+
+ SER_PUSH_FIELD(&p_struct->keys_own, ble_gap_sec_keys_t_enc);
+ SER_PUSH_FIELD(&p_struct->keys_peer, ble_gap_sec_keys_t_enc);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gap_sec_keyset_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gap_sec_keyset_t);
+
+ SER_PULL_FIELD(&p_struct->keys_own, ble_gap_sec_keys_t_dec);
+ SER_PULL_FIELD(&p_struct->keys_peer, ble_gap_sec_keys_t_dec);
+
+ SER_STRUCT_DEC_END;
+}
+
+uint32_t ble_gap_evt_sec_request_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gap_evt_sec_request_t);
+
+ uint8_t ser_data = (p_struct->bond & 0x01)
+ | ((p_struct->mitm & 0x01) << 1)
+ | ((p_struct->lesc & 0x01) << 2)
+ | ((p_struct->keypress & 0x01) << 3);
+ SER_PUSH_uint8(&ser_data);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gap_evt_sec_request_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gap_evt_sec_request_t);
+
+ uint8_t ser_data;
+ SER_PULL_uint8(&ser_data);
+ p_struct->bond = ser_data & 0x01;
+ p_struct->mitm = (ser_data >> 1) & 0x01;
+ p_struct->lesc = (ser_data >> 2) & 0x01;
+ p_struct->keypress = (ser_data >> 3) & 0x01;
+
+ SER_STRUCT_DEC_END;
+}
+
+uint32_t ble_gap_sec_kdist_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gap_sec_kdist_t);
+
+ uint8_t ser_data = (p_struct->enc & 0x01)
+ | (p_struct->id & 0x01) << 1
+ | (p_struct->sign & 0x01) << 2
+ | (p_struct->link & 0x01) << 3;
+ SER_PUSH_uint8(&ser_data);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gap_sec_kdist_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gap_sec_kdist_t);
+
+ uint8_t ser_data;
+ SER_PULL_uint8(&ser_data);
+ p_struct->enc = ser_data & 0x01;
+ p_struct->id = (ser_data >> 1) & 0x01;
+ p_struct->sign = (ser_data >> 2) & 0x01;
+ p_struct->link = (ser_data >> 3) & 0x01;
+
+ SER_STRUCT_DEC_END;
+}
+
+uint32_t ble_gap_opt_ch_map_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gap_opt_ch_map_t);
+
+ SER_PUSH_uint16(&p_struct->conn_handle);
+ SER_PUSH_uint8array(p_struct->ch_map, 5);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gap_opt_ch_map_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gap_opt_ch_map_t);
+
+ SER_PULL_uint16(&p_struct->conn_handle);
+ SER_PULL_uint8array(p_struct->ch_map, 5);
+
+ SER_STRUCT_DEC_END;
+}
+
+uint32_t ble_gap_opt_local_conn_latency_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gap_opt_local_conn_latency_t);
+
+ SER_PUSH_uint16(&p_struct->conn_handle);
+ SER_PUSH_uint16(&p_struct->requested_latency);
+ SER_PUSH_COND(p_struct->p_actual_latency, uint16_t_enc);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gap_opt_local_conn_latency_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gap_opt_local_conn_latency_t);
+
+ SER_PULL_uint16(&p_struct->conn_handle);
+ SER_PULL_uint16(&p_struct->requested_latency);
+ SER_PULL_COND(&p_struct->p_actual_latency, uint16_t_dec);
+
+ SER_STRUCT_DEC_END;
+}
+
+uint32_t ble_gap_opt_passkey_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gap_opt_passkey_t);
+ SER_PUSH_buf(p_struct->p_passkey, BLE_GAP_PASSKEY_LEN);
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gap_opt_passkey_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gap_opt_passkey_t);
+ SER_PULL_buf((uint8_t**)&p_struct->p_passkey, BLE_GAP_PASSKEY_LEN, BLE_GAP_PASSKEY_LEN);
+ SER_STRUCT_DEC_END;
+}
+#if defined(NRF_SD_BLE_API_VERSION) && NRF_SD_BLE_API_VERSION < 6
+uint32_t ble_gap_opt_scan_req_report_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gap_opt_scan_req_report_t);
+
+ uint8_t ser_data = p_struct->enable & 0x01;
+ SER_PUSH_uint8(&ser_data);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gap_opt_scan_req_report_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gap_opt_scan_req_report_t);
+
+ uint8_t ser_data;
+ SER_PULL_uint8(&ser_data);
+ p_struct->enable = ser_data & 0x01;
+
+ SER_STRUCT_DEC_END;
+}
+#endif
+
+#if defined(NRF_SD_BLE_API_VERSION) && NRF_SD_BLE_API_VERSION < 4
+uint32_t ble_gap_opt_compat_mode_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gap_opt_compat_mode_t);
+
+ uint8_t ser_data = p_struct->mode_1_enable & 0x01;
+ SER_PUSH_uint8(&ser_data);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gap_opt_compat_mode_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gap_opt_compat_mode_t);
+
+ uint8_t ser_data;
+ SER_PULL_uint8(&ser_data);
+ p_struct->mode_1_enable = ser_data & 0x01;
+
+ SER_STRUCT_DEC_END;
+}
+#endif
+
+#if defined(NRF_SD_BLE_API_VERSION) && NRF_SD_BLE_API_VERSION < 6
+uint32_t ble_gap_adv_ch_mask_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gap_adv_ch_mask_t);
+
+ uint8_t ser_data = (p_struct->ch_37_off & 0x01)
+ | ((p_struct->ch_38_off & 0x01) << 1)
+ | ((p_struct->ch_39_off & 0x01) << 2);
+ SER_PUSH_uint8(&ser_data);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gap_adv_ch_mask_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gap_adv_ch_mask_t);
+
+ uint8_t ser_data;
+ SER_PULL_uint8(&ser_data);
+ p_struct->ch_37_off = ser_data & 0x01;
+ p_struct->ch_38_off = (ser_data >> 1) & 0x01;
+ p_struct->ch_39_off = (ser_data >> 2) & 0x01;
+
+ SER_STRUCT_DEC_END;
+}
+#endif
+
+#if defined(NRF_SD_BLE_API_VERSION) && NRF_SD_BLE_API_VERSION < 4
+uint32_t ble_gap_enable_params_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gap_enable_params_t);
+
+ SER_PUSH_uint8(&p_struct->periph_conn_count);
+ SER_PUSH_uint8(&p_struct->central_conn_count);
+ SER_PUSH_uint8(&p_struct->central_sec_count);
+ SER_PUSH_COND(p_struct->p_device_name, ble_gap_device_name_t_enc);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gap_enable_params_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gap_enable_params_t);
+
+ SER_PULL_uint8(&p_struct->periph_conn_count);
+ SER_PULL_uint8(&p_struct->central_conn_count);
+ SER_PULL_uint8(&p_struct->central_sec_count);
+ SER_PULL_COND(&p_struct->p_device_name, ble_gap_device_name_t_dec);
+
+ SER_STRUCT_DEC_END;
+}
+#endif
+
+uint32_t ble_gap_lesc_p256_pk_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gap_lesc_p256_pk_t);
+ SER_PUSH_uint8array(p_struct->pk, BLE_GAP_LESC_P256_PK_LEN);
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gap_lesc_p256_pk_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gap_lesc_p256_pk_t);
+ SER_PULL_uint8array(p_struct->pk, BLE_GAP_LESC_P256_PK_LEN);
+ SER_STRUCT_DEC_END;
+}
+
+uint32_t ble_gap_lesc_dhkey_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gap_lesc_dhkey_t);
+ SER_PUSH_uint8array(p_struct->key, BLE_GAP_LESC_DHKEY_LEN);
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gap_lesc_dhkey_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gap_lesc_dhkey_t);
+ SER_PULL_uint8array(p_struct->key, BLE_GAP_LESC_DHKEY_LEN);
+ SER_STRUCT_DEC_END;
+}
+
+uint32_t ble_gap_lesc_oob_data_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gap_lesc_oob_data_t);
+
+ SER_PUSH_FIELD(&p_struct->addr, ble_gap_addr_t_enc);
+ SER_PUSH_uint8array(p_struct->r, BLE_GAP_SEC_KEY_LEN);
+ SER_PUSH_uint8array(p_struct->c, BLE_GAP_SEC_KEY_LEN);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gap_lesc_oob_data_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gap_lesc_oob_data_t);
+
+ SER_PULL_FIELD(&p_struct->addr, ble_gap_addr_t_dec);
+ SER_PULL_uint8array(p_struct->r, BLE_GAP_SEC_KEY_LEN);
+ SER_PULL_uint8array(p_struct->c, BLE_GAP_SEC_KEY_LEN);
+
+ SER_STRUCT_DEC_END;
+}
+
+uint32_t ble_gap_adv_params_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gap_adv_params_t);
+#if defined(NRF_SD_BLE_API_VERSION) && NRF_SD_BLE_API_VERSION < 6
+ SER_PUSH_uint8(&p_struct->type);
+ SER_PUSH_COND(p_struct->p_peer_addr, ble_gap_addr_t_enc);
+ SER_PUSH_uint8(&p_struct->fp);
+ SER_PUSH_uint16(&p_struct->interval);
+ SER_PUSH_uint16(&p_struct->timeout);
+ SER_PUSH_FIELD(&p_struct->channel_mask, ble_gap_adv_ch_mask_t_enc);
+#else
+ SER_PUSH_FIELD(&p_struct->properties, ble_gap_adv_properties_t_enc);
+ SER_PUSH_COND(p_struct->p_peer_addr, ble_gap_addr_t_enc);
+ SER_PUSH_uint32(&p_struct->interval);
+ SER_PUSH_uint16(&p_struct->duration);
+ SER_PUSH_uint8(&p_struct->max_adv_evts);
+ SER_PUSH_buf(p_struct->channel_mask, 5);
+ SER_PUSH_uint8(&p_struct->filter_policy);
+ SER_PUSH_uint8(&p_struct->primary_phy);
+ SER_PUSH_uint8(&p_struct->secondary_phy);
+ uint8_t temp = p_struct->set_id | (p_struct->scan_req_notification << 4);
+ SER_PUSH_uint8(&temp);
+
+#endif
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gap_adv_params_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gap_adv_params_t);
+
+#if defined(NRF_SD_BLE_API_VERSION) && NRF_SD_BLE_API_VERSION < 6
+ SER_PULL_uint8(&p_struct->type);
+ SER_PULL_COND(&p_struct->p_peer_addr, ble_gap_addr_t_dec);
+ SER_PULL_uint8(&p_struct->fp);
+ SER_PULL_uint16(&p_struct->interval);
+ SER_PULL_uint16(&p_struct->timeout);
+ SER_PULL_FIELD(&p_struct->channel_mask, ble_gap_adv_ch_mask_t_dec);
+#else
+ SER_PULL_FIELD(&p_struct->properties, ble_gap_adv_properties_t_dec);
+ SER_PULL_COND(&p_struct->p_peer_addr, ble_gap_addr_t_dec);
+ SER_PULL_uint32(&p_struct->interval);
+ SER_PULL_uint16(&p_struct->duration);
+ SER_PULL_uint8(&p_struct->max_adv_evts);
+ uint8_t * p_channel_mask = p_struct->channel_mask;
+ SER_PULL_buf((uint8_t **)&p_channel_mask, 5, 5);
+ SER_PULL_uint8(&p_struct->filter_policy);
+ SER_PULL_uint8(&p_struct->primary_phy);
+ SER_PULL_uint8(&p_struct->secondary_phy);
+
+ uint8_t temp;
+ SER_PULL_uint8(&temp);
+ p_struct->set_id = temp & 0x0F;
+ p_struct->scan_req_notification = (temp & 0x10) ? 1 : 0;
+
+#endif
+
+ SER_STRUCT_DEC_END;
+}
+#if defined(NRF_SD_BLE_API_VERSION) && NRF_SD_BLE_API_VERSION < 4
+uint32_t ble_gap_opt_ext_len_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gap_opt_ext_len_t);
+ SER_PUSH_uint8(&p_struct->rxtx_max_pdu_payload_size);
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gap_opt_ext_len_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gap_opt_ext_len_t);
+ SER_PULL_uint8(&p_struct->rxtx_max_pdu_payload_size);
+ SER_STRUCT_DEC_END;
+}
+#endif
+uint32_t ble_gap_opt_auth_payload_timeout_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gap_opt_auth_payload_timeout_t);
+
+ SER_PUSH_uint16(&p_struct->conn_handle);
+ SER_PUSH_uint16(&p_struct->auth_payload_timeout);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gap_opt_auth_payload_timeout_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gap_opt_auth_payload_timeout_t);
+
+ SER_PULL_uint16(&p_struct->conn_handle);
+ SER_PULL_uint16(&p_struct->auth_payload_timeout);
+
+ SER_STRUCT_DEC_END;
+}
+
+#if defined(NRF_SD_BLE_API_VERSION) && NRF_SD_BLE_API_VERSION < 4
+uint32_t ble_gap_device_name_t_enc
+#else
+uint32_t ble_gap_cfg_device_name_t_enc
+#endif
+ (void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+
+{
+#if defined(NRF_SD_BLE_API_VERSION) && NRF_SD_BLE_API_VERSION < 4
+ SER_STRUCT_ENC_BEGIN(ble_gap_device_name_t);
+#else
+ SER_STRUCT_ENC_BEGIN(ble_gap_cfg_device_name_t);
+#endif
+ /* serializer does not support attributes on stack */
+ if (p_struct->vloc != BLE_GATTS_VLOC_STACK)
+ {
+ err_code = NRF_ERROR_INVALID_PARAM;
+ }
+
+ SER_PUSH_FIELD(&p_struct->write_perm, ble_gap_conn_sec_mode_t_enc);
+
+ uint8_t ser_data = p_struct->vloc & 0x03;
+ SER_PUSH_uint8(&ser_data);
+ SER_PUSH_uint16(&p_struct->current_len);
+ SER_PUSH_uint16(&p_struct->max_len);
+ SER_PUSH_buf(p_struct->p_value, p_struct->current_len);
+
+ SER_STRUCT_ENC_END;
+}
+
+#if defined(NRF_SD_BLE_API_VERSION) && NRF_SD_BLE_API_VERSION < 4
+uint32_t ble_gap_device_name_t_dec
+#else
+uint32_t ble_gap_cfg_device_name_t_dec
+#endif
+ (uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+#if defined(NRF_SD_BLE_API_VERSION) && NRF_SD_BLE_API_VERSION < 4
+ SER_STRUCT_DEC_BEGIN(ble_gap_device_name_t);
+#else
+ SER_STRUCT_DEC_BEGIN(ble_gap_cfg_device_name_t);
+#endif
+
+ uint16_t value_max_len = p_struct->max_len;
+ uint8_t ser_data;
+ SER_PULL_FIELD(&p_struct->write_perm, ble_gap_conn_sec_mode_t_dec);
+ SER_PULL_uint8(&ser_data);
+ p_struct->vloc = ser_data & 0x03;
+ SER_PULL_uint16(&p_struct->current_len);
+ SER_PULL_uint16(&p_struct->max_len);
+ SER_PULL_buf(&p_struct->p_value,value_max_len, p_struct->current_len);
+
+ SER_STRUCT_DEC_END;
+}
+
+
+
+uint32_t ble_gap_privacy_params_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gap_privacy_params_t);
+
+ SER_PUSH_uint8(&p_struct->privacy_mode);
+ SER_PUSH_uint8(&p_struct->private_addr_type);
+ SER_PUSH_uint16(&p_struct->private_addr_cycle_s);
+ SER_PUSH_COND(p_struct->p_device_irk, ble_gap_irk_t_enc);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gap_privacy_params_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gap_privacy_params_t);
+
+ SER_PULL_uint8(&p_struct->privacy_mode);
+ SER_PULL_uint8(&p_struct->private_addr_type);
+ SER_PULL_uint16(&p_struct->private_addr_cycle_s);
+ SER_PULL_COND(&p_struct->p_device_irk, ble_gap_irk_t_dec);
+
+ SER_STRUCT_DEC_END;
+}
+
+
+
+
+#if NRF_SD_BLE_API_VERSION >= 4
+#ifndef S112
+uint32_t ble_gap_opt_compat_mode_1_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gap_opt_compat_mode_1_t);
+
+ uint8_t enable = p_struct->enable;
+ SER_PUSH_uint8(&enable);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gap_opt_compat_mode_1_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gap_opt_compat_mode_1_t);
+
+ uint8_t enable;
+ SER_PULL_uint8(&enable);
+ p_struct->enable = enable;
+
+ SER_STRUCT_DEC_END;
+}
+#endif //!S112
+
+uint32_t ble_gap_opt_slave_latency_disable_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gap_opt_slave_latency_disable_t);
+
+ SER_PUSH_uint16(&p_struct->conn_handle);
+ uint8_t disable = p_struct->disable;
+ SER_PUSH_uint8(&disable);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gap_opt_slave_latency_disable_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gap_opt_slave_latency_disable_t);
+
+ SER_PULL_uint16(&p_struct->conn_handle);
+ uint8_t disable;
+ SER_PULL_uint8(&disable);
+ p_struct->disable = disable;
+
+ SER_STRUCT_DEC_END;
+}
+
+uint32_t ble_gap_conn_cfg_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gap_conn_cfg_t);
+
+ SER_PUSH_uint8(&p_struct->conn_count);
+ SER_PUSH_uint16(&p_struct->event_length);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gap_conn_cfg_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gap_conn_cfg_t);
+
+ SER_PULL_uint8(&p_struct->conn_count);
+ SER_PULL_uint16(&p_struct->event_length);
+
+ SER_STRUCT_DEC_END;
+}
+
+uint32_t ble_gap_cfg_role_count_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gap_cfg_role_count_t);
+
+ SER_PUSH_uint8(&p_struct->periph_role_count);
+#ifndef S112
+ SER_PUSH_uint8(&p_struct->central_role_count);
+ SER_PUSH_uint8(&p_struct->central_sec_count);
+#endif //!S112
+#if NRF_SD_BLE_API_VERSION > 5
+ SER_PUSH_uint8(&p_struct->adv_set_count);
+#ifndef S112
+ uint32_t temp = p_struct->qos_channel_survey_role_available;
+ SER_PUSH_uint8(&temp);
+#endif //!S112
+#endif
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gap_cfg_role_count_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gap_cfg_role_count_t);
+
+ SER_PULL_uint8(&p_struct->periph_role_count);
+#ifndef S112
+ SER_PULL_uint8(&p_struct->central_role_count);
+ SER_PULL_uint8(&p_struct->central_sec_count);
+#endif //!S112
+#if NRF_SD_BLE_API_VERSION > 5
+ SER_PULL_uint8(&p_struct->adv_set_count);
+#ifndef S112
+ uint8_t temp;
+ SER_PULL_uint8(&temp);
+ p_struct->qos_channel_survey_role_available = temp;
+#endif //!S112
+#endif
+ SER_STRUCT_DEC_END;
+}
+
+#ifndef S112
+uint32_t ble_gap_data_length_params_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gap_data_length_params_t);
+
+ SER_PUSH_uint16(&p_struct->max_tx_octets);
+ SER_PUSH_uint16(&p_struct->max_rx_octets);
+ SER_PUSH_uint16(&p_struct->max_tx_time_us);
+ SER_PUSH_uint16(&p_struct->max_rx_time_us);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gap_data_length_params_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gap_data_length_params_t);
+
+ SER_PULL_uint16(&p_struct->max_tx_octets);
+ SER_PULL_uint16(&p_struct->max_rx_octets);
+ SER_PULL_uint16(&p_struct->max_tx_time_us);
+ SER_PULL_uint16(&p_struct->max_rx_time_us);
+
+ SER_STRUCT_DEC_END;
+}
+
+uint32_t ble_gap_data_length_limitation_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gap_data_length_limitation_t);
+
+ SER_PUSH_uint16(&p_struct->tx_payload_limited_octets);
+ SER_PUSH_uint16(&p_struct->rx_payload_limited_octets);
+ SER_PUSH_uint16(&p_struct->tx_rx_time_limited_us);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gap_data_length_limitation_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gap_data_length_limitation_t);
+
+ SER_PULL_uint16(&p_struct->tx_payload_limited_octets);
+ SER_PULL_uint16(&p_struct->rx_payload_limited_octets);
+ SER_PULL_uint16(&p_struct->tx_rx_time_limited_us);
+
+ SER_STRUCT_DEC_END;
+}
+#endif //!S112
+#endif
+
+#if NRF_SD_BLE_API_VERSION == 4
+
+uint32_t ble_gap_opt_compat_mode_2_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gap_opt_compat_mode_2_t);
+
+ uint8_t enable = p_struct->enable;
+ SER_PUSH_uint8(&enable);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gap_opt_compat_mode_2_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gap_opt_compat_mode_2_t);
+
+ uint8_t enable;
+ SER_PULL_uint8(&enable);
+ p_struct->enable = enable;
+
+ SER_STRUCT_DEC_END;
+}
+
+#endif
+
+#if NRF_SD_BLE_API_VERSION >= 5
+uint32_t ble_gap_phys_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gap_phys_t);
+
+ SER_PUSH_uint8(&p_struct->tx_phys);
+ SER_PUSH_uint8(&p_struct->rx_phys);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gap_phys_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gap_phys_t);
+
+ SER_PULL_uint8(&p_struct->tx_phys);
+ SER_PULL_uint8(&p_struct->rx_phys);
+
+ SER_STRUCT_DEC_END;
+}
+#endif
+
+#if NRF_SD_BLE_API_VERSION > 5
+uint32_t ble_gap_adv_properties_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gap_adv_properties_t);
+
+ SER_PUSH_uint8(&p_struct->type);
+ uint8_t temp = p_struct->anonymous | (p_struct->include_tx_power << 1);
+ SER_PUSH_uint8(&temp);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gap_adv_properties_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gap_adv_properties_t);
+
+ SER_PULL_uint8(&p_struct->type);
+ uint8_t temp;
+ SER_PULL_uint8(&temp);
+ p_struct->anonymous = temp & 0x01;
+ p_struct->include_tx_power = (temp & 0x02) ? 1 : 0;
+
+ SER_STRUCT_DEC_END;
+}
+
+#ifndef S112
+uint32_t ble_gap_adv_report_type_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gap_adv_report_type_t);
+
+ uint16_t temp =
+ (p_struct->connectable << 0) |
+ (p_struct->scannable << 1) |
+ (p_struct->directed << 2) |
+ (p_struct->scan_response << 3) |
+ (p_struct->extended_pdu << 4) |
+ (p_struct->status << 5) |
+ (p_struct->reserved << 7);
+ SER_PUSH_uint16(&temp);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gap_adv_report_type_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gap_adv_report_type_t);
+
+ uint16_t temp;
+ SER_PULL_uint16(&temp);
+ p_struct->connectable = (temp >> 0) & 0x01;
+ p_struct->scannable = (temp >> 1) & 0x01;
+ p_struct->directed = (temp >> 2) & 0x01;
+ p_struct->scan_response = (temp >> 3) & 0x01;
+ p_struct->extended_pdu = (temp >> 4) & 0x01;
+ p_struct->status = (temp >> 5) & 0x03;
+ p_struct->reserved = (temp >> 7) & 0x1FF;
+
+ SER_STRUCT_DEC_END;
+}
+
+uint32_t ble_gap_aux_pointer_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gap_aux_pointer_t);
+
+ SER_PUSH_uint16(&p_struct->aux_offset);
+ SER_PUSH_uint8(&p_struct->aux_phy);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gap_aux_pointer_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gap_aux_pointer_t);
+
+ SER_PULL_uint16(&p_struct->aux_offset);
+ SER_PULL_uint8(&p_struct->aux_phy);
+
+ SER_STRUCT_DEC_END;
+}
+#endif //!S112
+
+uint32_t ble_gap_adv_data_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gap_adv_data_t);
+
+ SER_PUSH_FIELD(&p_struct->adv_data, ble_data_t_enc);
+ SER_PUSH_FIELD(&p_struct->scan_rsp_data, ble_data_t_enc);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gap_adv_data_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gap_adv_data_t);
+
+ SER_PULL_FIELD(&p_struct->adv_data, ble_data_t_dec);
+ SER_PULL_FIELD(&p_struct->scan_rsp_data, ble_data_t_dec);
+
+ SER_STRUCT_DEC_END;
+}
+
+uint32_t ble_gap_evt_adv_set_terminated_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gap_evt_adv_set_terminated_t);
+
+ SER_PUSH_uint8(&p_struct->reason);
+ SER_PUSH_uint8(&p_struct->adv_handle);
+ SER_PUSH_uint8(&p_struct->num_completed_adv_events);
+ SER_PUSH_uint16(&p_struct->adv_data.adv_data.len);
+ SER_PUSH_COND(&p_struct->adv_data.adv_data.p_data, NULL);
+ SER_PUSH_uint16(&p_struct->adv_data.scan_rsp_data.len);
+ SER_PUSH_COND(&p_struct->adv_data.scan_rsp_data.p_data, NULL);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gap_evt_adv_set_terminated_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gap_evt_adv_set_terminated_t);
+
+ SER_PULL_uint8(&p_struct->reason);
+ SER_PULL_uint8(&p_struct->adv_handle);
+ SER_PULL_uint8(&p_struct->num_completed_adv_events);
+ SER_PULL_uint16(&p_struct->adv_data.adv_data.len);
+ SER_PULL_COND(&p_struct->adv_data.adv_data.p_data, NULL);
+ SER_PULL_uint16(&p_struct->adv_data.scan_rsp_data.len);
+ SER_PULL_COND(&p_struct->adv_data.scan_rsp_data.p_data, NULL);
+
+ SER_STRUCT_DEC_END;
+}
+#endif
diff --git a/thirdparty/nRF5_SDK_15.0.0_a53641a/components/serialization/common/struct_ser/ble/ble_gap_struct_serialization.h b/thirdparty/nRF5_SDK_15.0.0_a53641a/components/serialization/common/struct_ser/ble/ble_gap_struct_serialization.h
new file mode 100644
index 0000000..918d6f5
--- /dev/null
+++ b/thirdparty/nRF5_SDK_15.0.0_a53641a/components/serialization/common/struct_ser/ble/ble_gap_struct_serialization.h
@@ -0,0 +1,612 @@
+/**
+ * Copyright (c) 2014 - 2018, Nordic Semiconductor ASA
+ *
+ * All rights reserved.
+ *
+ * Redistribution and use in source and binary forms, with or without modification,
+ * are permitted provided that the following conditions are met:
+ *
+ * 1. Redistributions of source code must retain the above copyright notice, this
+ * list of conditions and the following disclaimer.
+ *
+ * 2. Redistributions in binary form, except as embedded into a Nordic
+ * Semiconductor ASA integrated circuit in a product or a software update for
+ * such product, must reproduce the above copyright notice, this list of
+ * conditions and the following disclaimer in the documentation and/or other
+ * materials provided with the distribution.
+ *
+ * 3. Neither the name of Nordic Semiconductor ASA nor the names of its
+ * contributors may be used to endorse or promote products derived from this
+ * software without specific prior written permission.
+ *
+ * 4. This software, with or without modification, must only be used with a
+ * Nordic Semiconductor ASA integrated circuit.
+ *
+ * 5. Any software provided in binary form under this license must not be reverse
+ * engineered, decompiled, modified and/or disassembled.
+ *
+ * THIS SOFTWARE IS PROVIDED BY NORDIC SEMICONDUCTOR ASA "AS IS" AND ANY EXPRESS
+ * OR IMPLIED WARRANTIES, INCLUDING, BUT NOT LIMITED TO, THE IMPLIED WARRANTIES
+ * OF MERCHANTABILITY, NONINFRINGEMENT, AND FITNESS FOR A PARTICULAR PURPOSE ARE
+ * DISCLAIMED. IN NO EVENT SHALL NORDIC SEMICONDUCTOR ASA OR CONTRIBUTORS BE
+ * LIABLE FOR ANY DIRECT, INDIRECT, INCIDENTAL, SPECIAL, EXEMPLARY, OR
+ * CONSEQUENTIAL DAMAGES (INCLUDING, BUT NOT LIMITED TO, PROCUREMENT OF SUBSTITUTE
+ * GOODS OR SERVICES; LOSS OF USE, DATA, OR PROFITS; OR BUSINESS INTERRUPTION)
+ * HOWEVER CAUSED AND ON ANY THEORY OF LIABILITY, WHETHER IN CONTRACT, STRICT
+ * LIABILITY, OR TORT (INCLUDING NEGLIGENCE OR OTHERWISE) ARISING IN ANY WAY OUT
+ * OF THE USE OF THIS SOFTWARE, EVEN IF ADVISED OF THE POSSIBILITY OF SUCH DAMAGE.
+ *
+ */
+#ifndef BLE_GAP_STRUCT_SERIALIZATION_H__
+#define BLE_GAP_STRUCT_SERIALIZATION_H__
+
+#include "ble_gap.h"
+
+#ifdef __cplusplus
+extern "C" {
+#endif
+
+uint32_t ble_gap_evt_adv_report_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gap_evt_adv_report_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_gap_irk_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gap_irk_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_gap_addr_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gap_addr_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_gap_sec_levels_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gap_sec_levels_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_gap_sec_keys_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gap_sec_keys_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_gap_enc_info_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gap_enc_info_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_gap_sign_info_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gap_sign_info_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_gap_evt_auth_status_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gap_evt_auth_status_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_gap_conn_sec_mode_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gap_conn_sec_mode_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_gap_conn_sec_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gap_conn_sec_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_gap_evt_conn_sec_update_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gap_evt_conn_sec_update_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_gap_evt_sec_info_request_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gap_evt_sec_info_request_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_gap_evt_connected_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gap_evt_connected_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_gap_sec_params_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gap_sec_params_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_gap_evt_sec_params_request_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gap_evt_sec_params_request_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_gap_conn_params_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gap_conn_params_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_gap_evt_conn_param_update_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gap_evt_conn_param_update_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_gap_evt_conn_param_update_request_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gap_evt_conn_param_update_request_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_gap_evt_disconnected_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gap_evt_disconnected_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_gap_scan_params_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gap_scan_params_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_data);
+
+uint32_t ble_gap_master_id_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gap_master_id_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_gap_enc_key_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gap_enc_key_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_gap_id_key_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gap_id_key_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_gap_sec_keyset_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gap_sec_keyset_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_gap_evt_sec_request_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gap_evt_sec_request_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_gap_sec_kdist_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gap_sec_kdist_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_gap_opt_ch_map_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gap_opt_ch_map_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_gap_opt_local_conn_latency_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gap_opt_local_conn_latency_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_gap_opt_passkey_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gap_opt_passkey_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_gap_opt_scan_req_report_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gap_opt_scan_req_report_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+#if defined(NRF_SD_BLE_API_VERSION) && NRF_SD_BLE_API_VERSION < 4
+uint32_t ble_gap_opt_compat_mode_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gap_opt_compat_mode_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+#endif
+uint32_t ble_gap_adv_ch_mask_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gap_adv_ch_mask_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_gap_enable_params_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gap_enable_params_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_gap_lesc_p256_pk_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gap_lesc_p256_pk_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_gap_lesc_dhkey_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gap_lesc_dhkey_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_gap_lesc_oob_data_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gap_lesc_oob_data_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_gap_adv_params_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gap_adv_params_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+#if defined(NRF_SD_BLE_API_VERSION) && NRF_SD_BLE_API_VERSION < 4
+uint32_t ble_gap_opt_ext_len_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gap_opt_ext_len_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+#endif
+
+uint32_t ble_gap_opt_auth_payload_timeout_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gap_opt_auth_payload_timeout_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+#if defined(NRF_SD_BLE_API_VERSION) && NRF_SD_BLE_API_VERSION < 4
+uint32_t ble_gap_device_name_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gap_device_name_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+#else
+uint32_t ble_gap_cfg_device_name_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gap_cfg_device_name_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+#endif
+
+uint32_t ble_gap_privacy_params_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gap_privacy_params_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+#if NRF_SD_BLE_API_VERSION >= 4
+uint32_t ble_gap_opt_compat_mode_1_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gap_opt_compat_mode_1_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_gap_opt_compat_mode_2_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gap_opt_compat_mode_2_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+uint32_t ble_gap_opt_slave_latency_disable_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gap_opt_slave_latency_disable_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_gap_conn_cfg_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gap_conn_cfg_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_gap_cfg_role_count_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gap_cfg_role_count_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_gap_data_length_params_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gap_data_length_params_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_gap_data_length_limitation_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gap_data_length_limitation_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+#endif
+
+#if NRF_SD_BLE_API_VERSION >= 5
+uint32_t ble_gap_phys_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gap_phys_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+#endif
+
+#if NRF_SD_BLE_API_VERSION > 5
+uint32_t ble_gap_adv_properties_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gap_adv_properties_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_gap_adv_report_type_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gap_adv_report_type_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_gap_aux_pointer_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gap_aux_pointer_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_gap_adv_data_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gap_adv_data_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_gap_evt_adv_set_terminated_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gap_evt_adv_set_terminated_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+#endif
+
+#ifdef __cplusplus
+}
+#endif
+
+#endif // BLE_GAP_STRUCT_SERIALIZATION_H__
diff --git a/thirdparty/nRF5_SDK_15.0.0_a53641a/components/serialization/common/struct_ser/ble/ble_gatt_struct_serialization.c b/thirdparty/nRF5_SDK_15.0.0_a53641a/components/serialization/common/struct_ser/ble/ble_gatt_struct_serialization.c
new file mode 100644
index 0000000..f308ea8
--- /dev/null
+++ b/thirdparty/nRF5_SDK_15.0.0_a53641a/components/serialization/common/struct_ser/ble/ble_gatt_struct_serialization.c
@@ -0,0 +1,158 @@
+/**
+ * Copyright (c) 2016 - 2018, Nordic Semiconductor ASA
+ *
+ * All rights reserved.
+ *
+ * Redistribution and use in source and binary forms, with or without modification,
+ * are permitted provided that the following conditions are met:
+ *
+ * 1. Redistributions of source code must retain the above copyright notice, this
+ * list of conditions and the following disclaimer.
+ *
+ * 2. Redistributions in binary form, except as embedded into a Nordic
+ * Semiconductor ASA integrated circuit in a product or a software update for
+ * such product, must reproduce the above copyright notice, this list of
+ * conditions and the following disclaimer in the documentation and/or other
+ * materials provided with the distribution.
+ *
+ * 3. Neither the name of Nordic Semiconductor ASA nor the names of its
+ * contributors may be used to endorse or promote products derived from this
+ * software without specific prior written permission.
+ *
+ * 4. This software, with or without modification, must only be used with a
+ * Nordic Semiconductor ASA integrated circuit.
+ *
+ * 5. Any software provided in binary form under this license must not be reverse
+ * engineered, decompiled, modified and/or disassembled.
+ *
+ * THIS SOFTWARE IS PROVIDED BY NORDIC SEMICONDUCTOR ASA "AS IS" AND ANY EXPRESS
+ * OR IMPLIED WARRANTIES, INCLUDING, BUT NOT LIMITED TO, THE IMPLIED WARRANTIES
+ * OF MERCHANTABILITY, NONINFRINGEMENT, AND FITNESS FOR A PARTICULAR PURPOSE ARE
+ * DISCLAIMED. IN NO EVENT SHALL NORDIC SEMICONDUCTOR ASA OR CONTRIBUTORS BE
+ * LIABLE FOR ANY DIRECT, INDIRECT, INCIDENTAL, SPECIAL, EXEMPLARY, OR
+ * CONSEQUENTIAL DAMAGES (INCLUDING, BUT NOT LIMITED TO, PROCUREMENT OF SUBSTITUTE
+ * GOODS OR SERVICES; LOSS OF USE, DATA, OR PROFITS; OR BUSINESS INTERRUPTION)
+ * HOWEVER CAUSED AND ON ANY THEORY OF LIABILITY, WHETHER IN CONTRACT, STRICT
+ * LIABILITY, OR TORT (INCLUDING NEGLIGENCE OR OTHERWISE) ARISING IN ANY WAY OUT
+ * OF THE USE OF THIS SOFTWARE, EVEN IF ADVISED OF THE POSSIBILITY OF SUCH DAMAGE.
+ *
+ */
+#include "ble_serialization.h"
+#include "ble_struct_serialization.h"
+#include "ble_gatt_struct_serialization.h"
+#include "cond_field_serialization.h"
+#include "app_util.h"
+#include "ble_gatt.h"
+#include <string.h>
+
+uint32_t ble_gatt_char_props_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gatt_char_props_t);
+
+ uint8_t ser_data = (p_struct->broadcast & 0x01)
+ | ((p_struct->read & 0x01) << 1)
+ | ((p_struct->write_wo_resp & 0x01) << 2)
+ | ((p_struct->write & 0x01) << 3)
+ | ((p_struct->notify & 0x01) << 4)
+ | ((p_struct->indicate & 0x01) << 5)
+ | ((p_struct->auth_signed_wr & 0x01) << 6);
+ SER_PUSH_uint8(&ser_data);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gatt_char_props_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gatt_char_props_t);
+
+ uint8_t ser_data;
+ SER_PULL_uint8(&ser_data);
+ p_struct->broadcast = ser_data & 0x01;
+ p_struct->read = (ser_data >> 1) & 0x01;
+ p_struct->write_wo_resp = (ser_data >> 2) & 0x01;
+ p_struct->write = (ser_data >> 3) & 0x01;
+ p_struct->notify = (ser_data >> 4) & 0x01;
+ p_struct->indicate = (ser_data >> 5) & 0x01;
+ p_struct->auth_signed_wr = (ser_data >> 6) & 0x01;
+
+ SER_STRUCT_DEC_END;
+}
+
+uint32_t ble_gatt_char_ext_props_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gatt_char_ext_props_t);
+
+ uint8_t ser_data = (p_struct->reliable_wr & 0x01)
+ | ((p_struct->wr_aux & 0x01) << 1);
+ SER_PUSH_uint8(&ser_data);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gatt_char_ext_props_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gatt_char_ext_props_t);
+
+ uint8_t ser_data;
+ SER_PULL_uint8(&ser_data);
+ p_struct->reliable_wr = ser_data & 0x01;
+ p_struct->wr_aux = (ser_data >> 1) & 0x01;
+
+ SER_STRUCT_DEC_END;
+}
+
+#if defined(NRF_SD_BLE_API_VERSION) && NRF_SD_BLE_API_VERSION < 4
+uint32_t ble_gatt_enable_params_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gatt_enable_params_t);
+ SER_PUSH_uint16(&p_struct->att_mtu);
+ SER_STRUCT_ENC_END;
+}
+
+
+uint32_t ble_gatt_enable_params_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gatt_enable_params_t);
+ SER_PULL_uint16(&p_struct->att_mtu);
+ SER_STRUCT_DEC_END;
+}
+#else
+uint32_t ble_gatt_conn_cfg_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gatt_conn_cfg_t);
+ SER_PUSH_uint16(&p_struct->att_mtu);
+ SER_STRUCT_ENC_END;
+}
+
+
+uint32_t ble_gatt_conn_cfg_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gatt_conn_cfg_t);
+ SER_PULL_uint16(&p_struct->att_mtu);
+ SER_STRUCT_DEC_END;
+}
+#endif
diff --git a/thirdparty/nRF5_SDK_15.0.0_a53641a/components/serialization/common/struct_ser/ble/ble_gatt_struct_serialization.h b/thirdparty/nRF5_SDK_15.0.0_a53641a/components/serialization/common/struct_ser/ble/ble_gatt_struct_serialization.h
new file mode 100644
index 0000000..d61eaa7
--- /dev/null
+++ b/thirdparty/nRF5_SDK_15.0.0_a53641a/components/serialization/common/struct_ser/ble/ble_gatt_struct_serialization.h
@@ -0,0 +1,94 @@
+/**
+ * Copyright (c) 2016 - 2018, Nordic Semiconductor ASA
+ *
+ * All rights reserved.
+ *
+ * Redistribution and use in source and binary forms, with or without modification,
+ * are permitted provided that the following conditions are met:
+ *
+ * 1. Redistributions of source code must retain the above copyright notice, this
+ * list of conditions and the following disclaimer.
+ *
+ * 2. Redistributions in binary form, except as embedded into a Nordic
+ * Semiconductor ASA integrated circuit in a product or a software update for
+ * such product, must reproduce the above copyright notice, this list of
+ * conditions and the following disclaimer in the documentation and/or other
+ * materials provided with the distribution.
+ *
+ * 3. Neither the name of Nordic Semiconductor ASA nor the names of its
+ * contributors may be used to endorse or promote products derived from this
+ * software without specific prior written permission.
+ *
+ * 4. This software, with or without modification, must only be used with a
+ * Nordic Semiconductor ASA integrated circuit.
+ *
+ * 5. Any software provided in binary form under this license must not be reverse
+ * engineered, decompiled, modified and/or disassembled.
+ *
+ * THIS SOFTWARE IS PROVIDED BY NORDIC SEMICONDUCTOR ASA "AS IS" AND ANY EXPRESS
+ * OR IMPLIED WARRANTIES, INCLUDING, BUT NOT LIMITED TO, THE IMPLIED WARRANTIES
+ * OF MERCHANTABILITY, NONINFRINGEMENT, AND FITNESS FOR A PARTICULAR PURPOSE ARE
+ * DISCLAIMED. IN NO EVENT SHALL NORDIC SEMICONDUCTOR ASA OR CONTRIBUTORS BE
+ * LIABLE FOR ANY DIRECT, INDIRECT, INCIDENTAL, SPECIAL, EXEMPLARY, OR
+ * CONSEQUENTIAL DAMAGES (INCLUDING, BUT NOT LIMITED TO, PROCUREMENT OF SUBSTITUTE
+ * GOODS OR SERVICES; LOSS OF USE, DATA, OR PROFITS; OR BUSINESS INTERRUPTION)
+ * HOWEVER CAUSED AND ON ANY THEORY OF LIABILITY, WHETHER IN CONTRACT, STRICT
+ * LIABILITY, OR TORT (INCLUDING NEGLIGENCE OR OTHERWISE) ARISING IN ANY WAY OUT
+ * OF THE USE OF THIS SOFTWARE, EVEN IF ADVISED OF THE POSSIBILITY OF SUCH DAMAGE.
+ *
+ */
+#ifndef BLE_GATT_STRUCT_SERIALIZATION_H
+#define BLE_GATT_STRUCT_SERIALIZATION_H
+
+#include "ble_gatt.h"
+
+#ifdef __cplusplus
+extern "C" {
+#endif
+
+uint32_t ble_gatt_char_props_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gatt_char_props_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_gatt_char_ext_props_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gatt_char_ext_props_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+#if defined(NRF_SD_BLE_API_VERSION) && NRF_SD_BLE_API_VERSION < 4
+uint32_t ble_gatt_enable_params_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gatt_enable_params_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+#else
+uint32_t ble_gatt_conn_cfg_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gatt_conn_cfg_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+#endif
+#ifdef __cplusplus
+}
+#endif
+
+#endif /*BLE_GATT_STRUCT_SERIALIZATION_H*/
diff --git a/thirdparty/nRF5_SDK_15.0.0_a53641a/components/serialization/common/struct_ser/ble/ble_gattc_struct_serialization.c b/thirdparty/nRF5_SDK_15.0.0_a53641a/components/serialization/common/struct_ser/ble/ble_gattc_struct_serialization.c
new file mode 100644
index 0000000..b1b9db6
--- /dev/null
+++ b/thirdparty/nRF5_SDK_15.0.0_a53641a/components/serialization/common/struct_ser/ble/ble_gattc_struct_serialization.c
@@ -0,0 +1,715 @@
+/**
+ * Copyright (c) 2014 - 2018, Nordic Semiconductor ASA
+ *
+ * All rights reserved.
+ *
+ * Redistribution and use in source and binary forms, with or without modification,
+ * are permitted provided that the following conditions are met:
+ *
+ * 1. Redistributions of source code must retain the above copyright notice, this
+ * list of conditions and the following disclaimer.
+ *
+ * 2. Redistributions in binary form, except as embedded into a Nordic
+ * Semiconductor ASA integrated circuit in a product or a software update for
+ * such product, must reproduce the above copyright notice, this list of
+ * conditions and the following disclaimer in the documentation and/or other
+ * materials provided with the distribution.
+ *
+ * 3. Neither the name of Nordic Semiconductor ASA nor the names of its
+ * contributors may be used to endorse or promote products derived from this
+ * software without specific prior written permission.
+ *
+ * 4. This software, with or without modification, must only be used with a
+ * Nordic Semiconductor ASA integrated circuit.
+ *
+ * 5. Any software provided in binary form under this license must not be reverse
+ * engineered, decompiled, modified and/or disassembled.
+ *
+ * THIS SOFTWARE IS PROVIDED BY NORDIC SEMICONDUCTOR ASA "AS IS" AND ANY EXPRESS
+ * OR IMPLIED WARRANTIES, INCLUDING, BUT NOT LIMITED TO, THE IMPLIED WARRANTIES
+ * OF MERCHANTABILITY, NONINFRINGEMENT, AND FITNESS FOR A PARTICULAR PURPOSE ARE
+ * DISCLAIMED. IN NO EVENT SHALL NORDIC SEMICONDUCTOR ASA OR CONTRIBUTORS BE
+ * LIABLE FOR ANY DIRECT, INDIRECT, INCIDENTAL, SPECIAL, EXEMPLARY, OR
+ * CONSEQUENTIAL DAMAGES (INCLUDING, BUT NOT LIMITED TO, PROCUREMENT OF SUBSTITUTE
+ * GOODS OR SERVICES; LOSS OF USE, DATA, OR PROFITS; OR BUSINESS INTERRUPTION)
+ * HOWEVER CAUSED AND ON ANY THEORY OF LIABILITY, WHETHER IN CONTRACT, STRICT
+ * LIABILITY, OR TORT (INCLUDING NEGLIGENCE OR OTHERWISE) ARISING IN ANY WAY OUT
+ * OF THE USE OF THIS SOFTWARE, EVEN IF ADVISED OF THE POSSIBILITY OF SUCH DAMAGE.
+ *
+ */
+#include "ble_gatt_struct_serialization.h"
+#include "ble_gattc_struct_serialization.h"
+#include "ble_struct_serialization.h"
+#include "ble_serialization.h"
+#include "app_util.h"
+#include "ble_gattc.h"
+#include "cond_field_serialization.h"
+#include <string.h>
+
+uint32_t ble_gattc_evt_char_val_by_uuid_read_rsp_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gattc_evt_char_val_by_uuid_read_rsp_t);
+
+ SER_PUSH_uint16(&p_struct->count);
+ SER_PUSH_uint16(&p_struct->value_len);
+
+ // Copy the whole packed list.
+ uint16_t list_length = (p_struct->value_len + sizeof(uint16_t)) * p_struct->count;
+ SER_PUSH_uint8array(p_struct->handle_value, list_length);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gattc_evt_char_val_by_uuid_read_rsp_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ uint32_t * const p_ext_len,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gattc_evt_char_val_by_uuid_read_rsp_t);
+
+ SER_PULL_uint16(&p_struct->count);
+ SER_PULL_uint16(&p_struct->value_len);
+
+ uint16_t list_length = (p_struct->value_len + sizeof(uint16_t)) * p_struct->count;
+ SER_ASSERT_LENGTH_LEQ(list_length, *p_ext_len);
+ SER_PULL_uint8array(p_struct->handle_value, list_length);
+ *p_ext_len = list_length;
+
+ SER_STRUCT_DEC_END;
+}
+
+uint32_t ble_gattc_evt_char_vals_read_rsp_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gattc_evt_char_vals_read_rsp_t);
+
+ SER_PUSH_uint16(&p_struct->len);
+ SER_PUSH_uint8array(p_struct->values, p_struct->len);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gattc_evt_char_vals_read_rsp_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ uint32_t * const p_ext_len,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gattc_evt_char_vals_read_rsp_t);
+
+ SER_PULL_uint16(&p_struct->len);
+
+ SER_ASSERT_LENGTH_LEQ(p_struct->len, *p_ext_len);
+ SER_PULL_uint8array(p_struct->values, p_struct->len);
+ *p_ext_len = p_struct->len;
+
+ SER_STRUCT_DEC_END;
+}
+
+uint32_t ble_gattc_handle_range_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gattc_handle_range_t);
+
+ SER_PUSH_uint16(&p_struct->start_handle);
+ SER_PUSH_uint16(&p_struct->end_handle);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gattc_handle_range_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gattc_handle_range_t);
+
+ SER_PULL_uint16(&p_struct->start_handle);
+ SER_PULL_uint16(&p_struct->end_handle);
+
+ SER_STRUCT_DEC_END;
+}
+
+
+uint32_t ble_gattc_service_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gattc_service_t);
+
+ SER_PUSH_FIELD(&p_struct->uuid, ble_uuid_t_enc);
+ SER_PUSH_FIELD(&p_struct->handle_range, ble_gattc_handle_range_t_enc);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gattc_service_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gattc_service_t);
+
+ SER_PULL_FIELD(&p_struct->uuid, ble_uuid_t_dec);
+ SER_PULL_FIELD(&p_struct->handle_range, ble_gattc_handle_range_t_dec);
+
+ SER_STRUCT_DEC_END;
+}
+
+uint32_t ble_gattc_include_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gattc_include_t);
+
+ SER_PUSH_uint16(&p_struct->handle);
+ SER_PUSH_FIELD(&p_struct->included_srvc, ble_gattc_service_t_enc);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gattc_include_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gattc_include_t);
+
+ SER_PULL_uint16(&p_struct->handle);
+ SER_PULL_FIELD(&p_struct->included_srvc, ble_gattc_service_t_dec);
+
+ SER_STRUCT_DEC_END;
+}
+
+uint32_t ble_gattc_evt_rel_disc_rsp_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gattc_evt_rel_disc_rsp_t);
+
+ SER_PUSH_uint16(&p_struct->count);
+
+ ble_gattc_include_t * p_include = &(p_struct->includes[0]);
+ uint32_t i;
+
+ for (i = 0; i < p_struct->count; i++)
+ {
+ SER_PUSH_FIELD(p_include, ble_gattc_include_t_enc);
+ ++p_include;
+ }
+
+ SER_STRUCT_ENC_END;
+}
+
+
+
+uint32_t ble_gattc_evt_rel_disc_rsp_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ uint32_t * const p_ext_len,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gattc_evt_rel_disc_rsp_t);
+
+ SER_PULL_uint16(&p_struct->count);
+
+ uint32_t data_len = (SUB1(p_struct->count) * sizeof(ble_gattc_include_t));
+ SER_ASSERT_LENGTH_LEQ(data_len, *p_ext_len);
+
+ ble_gattc_include_t * p_include = &(p_struct->includes[0]);
+ uint32_t i;
+
+ for (i = 0; i < p_struct->count; i++)
+ {
+ SER_PULL_FIELD(p_include, ble_gattc_include_t_dec);
+ ++p_include;
+ }
+
+ *p_ext_len = data_len;
+ SER_STRUCT_DEC_END;
+}
+
+uint32_t ble_gattc_write_params_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gattc_write_params_t);
+
+ SER_PUSH_uint8(&p_struct->write_op);
+ SER_PUSH_uint8(&p_struct->flags);
+ SER_PUSH_uint16(&p_struct->handle);
+ SER_PUSH_uint16(&p_struct->offset);
+ SER_PUSH_len16data(p_struct->p_value, p_struct->len);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gattc_write_params_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gattc_write_params_t);
+
+ SER_PULL_uint8(&p_struct->write_op);
+ SER_PULL_uint8(&p_struct->flags);
+ SER_PULL_uint16(&p_struct->handle);
+ SER_PULL_uint16(&p_struct->offset);
+ SER_PULL_len16data((uint8_t **) &p_struct->p_value, &p_struct->len);
+
+ SER_STRUCT_DEC_END;
+}
+
+uint32_t ble_gattc_attr_info16_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gattc_attr_info16_t);
+
+ SER_PUSH_uint16(&p_struct->handle);
+ SER_PUSH_FIELD(&(p_struct->uuid), ble_uuid_t_enc);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gattc_attr_info16_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gattc_attr_info16_t);
+
+ SER_PULL_uint16(&p_struct->handle);
+ SER_PULL_FIELD(&(p_struct->uuid), ble_uuid_t_dec);
+
+ SER_STRUCT_DEC_END;
+}
+
+uint32_t ble_gattc_attr_info128_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gattc_attr_info128_t);
+
+ SER_PUSH_uint16(&p_struct->handle);
+ SER_PUSH_FIELD(&(p_struct->uuid), ble_uuid128_t_enc);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gattc_attr_info128_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gattc_attr_info128_t);
+
+ SER_PULL_uint16(&p_struct->handle);
+ SER_PULL_FIELD(&(p_struct->uuid), ble_uuid128_t_dec);
+
+ SER_STRUCT_DEC_END;
+}
+
+uint32_t ble_gattc_evt_attr_info_disc_rsp_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gattc_evt_attr_info_disc_rsp_t);
+
+ SER_PUSH_uint16(&p_struct->count);
+ SER_PUSH_uint8(&p_struct->format);
+
+ field_encoder_handler_t fp_encoder = (p_struct->format == BLE_GATTC_ATTR_INFO_FORMAT_16BIT) ?
+ ble_gattc_attr_info16_t_enc : ble_gattc_attr_info128_t_enc;
+
+ uint32_t i;
+ for (i = 0; i < p_struct->count; ++i)
+ {
+ void * uuid_struct;
+ uuid_struct = (p_struct->format == BLE_GATTC_ATTR_INFO_FORMAT_16BIT) ?
+ (void *)&(p_struct->info.attr_info16[i]) : (void *)&(p_struct->info.attr_info128[i]);
+ SER_PUSH_FIELD(uuid_struct, fp_encoder);
+ }
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gattc_evt_attr_info_disc_rsp_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ uint32_t * const p_ext_len,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gattc_evt_attr_info_disc_rsp_t);
+
+ SER_PULL_uint16(&p_struct->count);
+ SER_PULL_uint8(&p_struct->format);
+
+ uint32_t i;
+ uint32_t data_len;
+ field_decoder_handler_t fp_decoder;
+ if (p_struct->format == BLE_GATTC_ATTR_INFO_FORMAT_16BIT)
+ {
+ fp_decoder = ble_gattc_attr_info16_t_dec;
+ data_len = (SUB1(p_struct->count) * sizeof(ble_gattc_attr_info16_t));
+ }
+ else
+ {
+ fp_decoder = ble_gattc_attr_info128_t_dec;
+ data_len = (SUB1(p_struct->count) * sizeof(ble_gattc_attr_info128_t));
+ }
+ SER_ASSERT_LENGTH_LEQ(data_len, *p_ext_len);
+
+ for (i = 0; i < p_struct->count; i++)
+ {
+ void * uuid_struct;
+ uuid_struct = (p_struct->format == BLE_GATTC_ATTR_INFO_FORMAT_16BIT) ?
+ (void *)&(p_struct->info.attr_info16[i]) : (void *)&(p_struct->info.attr_info128[i]);
+ SER_PULL_FIELD(uuid_struct, fp_decoder);
+ }
+
+ *p_ext_len = data_len;
+ SER_STRUCT_DEC_END;
+}
+
+uint32_t ble_gattc_char_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gattc_char_t);
+
+ uint8_t ser_data;
+ SER_PUSH_FIELD(&p_struct->uuid, ble_uuid_t_enc);
+ SER_PUSH_FIELD(&p_struct->char_props, ble_gatt_char_props_t_enc);
+ ser_data = p_struct->char_ext_props & 0x01;
+ SER_PUSH_uint8(&ser_data);
+ SER_PUSH_uint16(&p_struct->handle_decl);
+ SER_PUSH_uint16(&p_struct->handle_value);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gattc_char_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gattc_char_t);
+
+ uint8_t ser_data;
+ SER_PULL_FIELD(&p_struct->uuid, ble_uuid_t_dec);
+ SER_PULL_FIELD(&p_struct->char_props, ble_gatt_char_props_t_dec);
+ SER_PULL_uint8(&ser_data);
+ p_struct->char_ext_props = ser_data & 0x01;
+ SER_PULL_uint16(&p_struct->handle_decl);
+ SER_PULL_uint16(&p_struct->handle_value);
+
+ SER_STRUCT_DEC_END;
+}
+
+uint32_t ble_gattc_evt_char_disc_rsp_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gattc_evt_char_disc_rsp_t);
+
+ SER_PUSH_uint16(&p_struct->count);
+ SER_PUSH_FIELD_ARRAY(p_struct->chars, ble_gattc_char_t_enc, p_struct->count);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gattc_evt_char_disc_rsp_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ uint32_t * const p_ext_len,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gattc_evt_char_disc_rsp_t);
+
+ SER_PULL_uint16(&p_struct->count);
+ uint32_t data_len = (SUB1(p_struct->count) * sizeof(ble_gattc_char_t));
+ SER_ASSERT_LENGTH_LEQ(data_len, *p_ext_len);
+
+ SER_PULL_FIELD_ARRAY(p_struct->chars, ble_gattc_char_t_dec, p_struct->count);
+
+ *p_ext_len = data_len;
+ SER_STRUCT_DEC_END;
+}
+
+uint32_t ble_gattc_desc_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gattc_desc_t);
+
+ SER_PUSH_uint16(&p_struct->handle);
+ SER_PUSH_FIELD(&p_struct->uuid, ble_uuid_t_enc);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gattc_desc_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gattc_desc_t);
+
+ SER_PULL_uint16(&p_struct->handle);
+ SER_PULL_FIELD(&p_struct->uuid, ble_uuid_t_dec);
+
+ SER_STRUCT_DEC_END;
+}
+
+uint32_t ble_gattc_evt_desc_disc_rsp_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gattc_evt_desc_disc_rsp_t);
+
+ SER_PUSH_uint16(&p_struct->count);
+ SER_PUSH_FIELD_ARRAY(p_struct->descs, ble_gattc_desc_t_enc, p_struct->count);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gattc_evt_desc_disc_rsp_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ uint32_t * const p_ext_len,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gattc_evt_desc_disc_rsp_t);
+
+ SER_PULL_uint16(&p_struct->count);
+ uint32_t data_len = (SUB1(p_struct->count) * sizeof(ble_gattc_desc_t));
+ SER_ASSERT_LENGTH_LEQ(data_len, *p_ext_len);
+
+ SER_PULL_FIELD_ARRAY(p_struct->descs, ble_gattc_desc_t_dec, p_struct->count);
+
+ *p_ext_len = data_len;
+ SER_STRUCT_DEC_END;
+}
+
+uint32_t ble_gattc_evt_hvx_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gattc_evt_hvx_t);
+
+ SER_PUSH_uint16(&p_struct->handle);
+ SER_PUSH_uint8(&p_struct->type);
+ SER_PUSH_uint16(&p_struct->len);
+ SER_PUSH_uint8array(p_struct->data, p_struct->len);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gattc_evt_hvx_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ uint32_t * const p_ext_len,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gattc_evt_hvx_t);
+
+ SER_PULL_uint16(&p_struct->handle);
+ SER_PULL_uint8(&p_struct->type);
+ SER_PULL_uint16(&p_struct->len);
+
+ uint32_t data_len = (SUB1(p_struct->len));
+ SER_ASSERT_LENGTH_LEQ(data_len, *p_ext_len);
+
+ SER_PULL_uint8array(p_struct->data, p_struct->len);
+
+ *p_ext_len = data_len;
+ SER_STRUCT_DEC_END;
+}
+
+uint32_t ble_gattc_evt_prim_srvc_disc_rsp_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gattc_evt_prim_srvc_disc_rsp_t);
+
+ SER_PUSH_uint16(&p_struct->count);
+ SER_PUSH_FIELD_ARRAY(p_struct->services, ble_gattc_service_t_enc, p_struct->count);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gattc_evt_prim_srvc_disc_rsp_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ uint32_t * const p_ext_len,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gattc_evt_prim_srvc_disc_rsp_t);
+
+ SER_PULL_uint16(&p_struct->count);
+ uint32_t data_len = (SUB1(p_struct->count) * sizeof(ble_gattc_service_t));
+ SER_ASSERT_LENGTH_LEQ(data_len, *p_ext_len);
+
+ SER_PULL_FIELD_ARRAY(p_struct->services, ble_gattc_service_t_dec, p_struct->count);
+
+ *p_ext_len = data_len;
+ SER_STRUCT_DEC_END;
+}
+
+uint32_t ble_gattc_evt_read_rsp_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gattc_evt_read_rsp_t);
+
+ SER_PUSH_uint16(&p_struct->handle);
+ SER_PUSH_uint16(&p_struct->offset);
+ SER_PUSH_uint16(&p_struct->len);
+ SER_PUSH_uint8array(p_struct->data, p_struct->len);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gattc_evt_read_rsp_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ uint32_t * const p_ext_len,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gattc_evt_read_rsp_t);
+
+ SER_PULL_uint16(&p_struct->handle);
+ SER_PULL_uint16(&p_struct->offset);
+ SER_PULL_uint16(&p_struct->len);
+
+ uint32_t data_len = (SUB1(p_struct->len));
+ SER_ASSERT_LENGTH_LEQ(data_len, *p_ext_len);
+
+ SER_PULL_uint8array(p_struct->data, p_struct->len);
+
+ *p_ext_len = data_len;
+ SER_STRUCT_DEC_END;
+}
+
+uint32_t ble_gattc_evt_timeout_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gattc_evt_timeout_t);
+ SER_PUSH_uint8(&p_struct->src);
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gattc_evt_timeout_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gattc_evt_timeout_t);
+ SER_PULL_uint8(&p_struct->src);
+ SER_STRUCT_DEC_END;
+}
+
+uint32_t ble_gattc_evt_write_rsp_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gattc_evt_write_rsp_t);
+
+ SER_PUSH_uint16(&p_struct->handle);
+ SER_PUSH_uint8(&p_struct->write_op);
+ SER_PUSH_uint16(&p_struct->offset);
+ SER_PUSH_uint16(&p_struct->len);
+ SER_PUSH_uint8array(p_struct->data, p_struct->len);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gattc_evt_write_rsp_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ uint32_t * const p_ext_len,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gattc_evt_write_rsp_t);
+
+ SER_PULL_uint16(&p_struct->handle);
+ SER_PULL_uint8(&p_struct->write_op);
+ SER_PULL_uint16(&p_struct->offset);
+ SER_PULL_uint16(&p_struct->len);
+
+ uint32_t data_len = (SUB1(p_struct->len));
+ SER_ASSERT_LENGTH_LEQ(data_len, *p_ext_len);
+
+ SER_PULL_uint8array(p_struct->data, p_struct->len);
+
+ *p_ext_len = data_len;
+ SER_STRUCT_DEC_END;
+}
+
+uint32_t ble_gattc_evt_exchange_mtu_rsp_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gattc_evt_exchange_mtu_rsp_t);
+ SER_PUSH_uint16(&p_struct->server_rx_mtu);
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gattc_evt_exchange_mtu_rsp_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gattc_evt_exchange_mtu_rsp_t);
+ SER_PULL_uint16(&p_struct->server_rx_mtu);
+ SER_STRUCT_DEC_END;
+}
+
+#if NRF_SD_BLE_API_VERSION >= 4
+uint32_t ble_gattc_conn_cfg_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gattc_conn_cfg_t);
+ SER_PUSH_uint8(&p_struct->write_cmd_tx_queue_size);
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gattc_conn_cfg_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gattc_conn_cfg_t);
+ SER_PULL_uint8(&p_struct->write_cmd_tx_queue_size);
+ SER_STRUCT_DEC_END;
+}
+#endif
diff --git a/thirdparty/nRF5_SDK_15.0.0_a53641a/components/serialization/common/struct_ser/ble/ble_gattc_struct_serialization.h b/thirdparty/nRF5_SDK_15.0.0_a53641a/components/serialization/common/struct_ser/ble/ble_gattc_struct_serialization.h
new file mode 100644
index 0000000..f17e58f
--- /dev/null
+++ b/thirdparty/nRF5_SDK_15.0.0_a53641a/components/serialization/common/struct_ser/ble/ble_gattc_struct_serialization.h
@@ -0,0 +1,293 @@
+/**
+ * Copyright (c) 2014 - 2018, Nordic Semiconductor ASA
+ *
+ * All rights reserved.
+ *
+ * Redistribution and use in source and binary forms, with or without modification,
+ * are permitted provided that the following conditions are met:
+ *
+ * 1. Redistributions of source code must retain the above copyright notice, this
+ * list of conditions and the following disclaimer.
+ *
+ * 2. Redistributions in binary form, except as embedded into a Nordic
+ * Semiconductor ASA integrated circuit in a product or a software update for
+ * such product, must reproduce the above copyright notice, this list of
+ * conditions and the following disclaimer in the documentation and/or other
+ * materials provided with the distribution.
+ *
+ * 3. Neither the name of Nordic Semiconductor ASA nor the names of its
+ * contributors may be used to endorse or promote products derived from this
+ * software without specific prior written permission.
+ *
+ * 4. This software, with or without modification, must only be used with a
+ * Nordic Semiconductor ASA integrated circuit.
+ *
+ * 5. Any software provided in binary form under this license must not be reverse
+ * engineered, decompiled, modified and/or disassembled.
+ *
+ * THIS SOFTWARE IS PROVIDED BY NORDIC SEMICONDUCTOR ASA "AS IS" AND ANY EXPRESS
+ * OR IMPLIED WARRANTIES, INCLUDING, BUT NOT LIMITED TO, THE IMPLIED WARRANTIES
+ * OF MERCHANTABILITY, NONINFRINGEMENT, AND FITNESS FOR A PARTICULAR PURPOSE ARE
+ * DISCLAIMED. IN NO EVENT SHALL NORDIC SEMICONDUCTOR ASA OR CONTRIBUTORS BE
+ * LIABLE FOR ANY DIRECT, INDIRECT, INCIDENTAL, SPECIAL, EXEMPLARY, OR
+ * CONSEQUENTIAL DAMAGES (INCLUDING, BUT NOT LIMITED TO, PROCUREMENT OF SUBSTITUTE
+ * GOODS OR SERVICES; LOSS OF USE, DATA, OR PROFITS; OR BUSINESS INTERRUPTION)
+ * HOWEVER CAUSED AND ON ANY THEORY OF LIABILITY, WHETHER IN CONTRACT, STRICT
+ * LIABILITY, OR TORT (INCLUDING NEGLIGENCE OR OTHERWISE) ARISING IN ANY WAY OUT
+ * OF THE USE OF THIS SOFTWARE, EVEN IF ADVISED OF THE POSSIBILITY OF SUCH DAMAGE.
+ *
+ */
+#ifndef BLE_GATTC_STRUCT_SERIALIZATION_H
+#define BLE_GATTC_STRUCT_SERIALIZATION_H
+
+#include "ble_gattc.h"
+
+#ifdef __cplusplus
+extern "C" {
+#endif
+
+uint32_t ble_gattc_evt_char_val_by_uuid_read_rsp_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gattc_evt_char_val_by_uuid_read_rsp_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ uint32_t * const p_ext_len,
+ void * const p_void_struct);
+
+uint32_t ble_gattc_evt_char_vals_read_rsp_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gattc_evt_char_vals_read_rsp_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ uint32_t * const p_ext_len,
+ void * const p_void_struct);
+
+uint32_t ble_gattc_handle_range_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gattc_handle_range_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_gattc_service_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gattc_service_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_gattc_include_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gattc_include_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_gattc_evt_rel_disc_rsp_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gattc_evt_rel_disc_rsp_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ uint32_t * const p_ext_len,
+ void * const p_void_struct);
+
+uint32_t ble_gattc_write_params_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gattc_write_params_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_gattc_attr_info16_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gattc_attr_info16_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_gattc_attr_info128_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gattc_attr_info128_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_gattc_evt_attr_info_disc_rsp_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gattc_evt_attr_info_disc_rsp_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ uint32_t * const p_ext_len,
+ void * const p_void_struct);
+
+uint32_t ble_gatt_char_props_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gatt_char_props_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_gatt_char_ext_props_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gatt_char_ext_props_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_gattc_char_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gattc_char_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_gattc_evt_char_disc_rsp_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gattc_evt_char_disc_rsp_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ uint32_t * const p_ext_len,
+ void * const p_void_struct);
+
+uint32_t ble_gattc_desc_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gattc_desc_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_gattc_evt_desc_disc_rsp_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gattc_evt_desc_disc_rsp_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ uint32_t * const p_ext_len,
+ void * const p_void_struct);
+
+uint32_t ble_gattc_evt_hvx_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gattc_evt_hvx_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ uint32_t * const p_ext_len,
+ void * const p_void_struct);
+
+uint32_t ble_gattc_evt_prim_srvc_disc_rsp_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gattc_evt_prim_srvc_disc_rsp_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ uint32_t * const p_ext_len,
+ void * const p_void_struct);
+
+uint32_t ble_gattc_evt_read_rsp_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gattc_evt_read_rsp_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ uint32_t * const p_ext_len,
+ void * const p_void_struct);
+
+uint32_t ble_gattc_evt_timeout_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gattc_evt_timeout_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_gattc_evt_write_rsp_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gattc_evt_write_rsp_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ uint32_t * const p_ext_len,
+ void * const p_void_struct);
+
+uint32_t ble_gattc_evt_exchange_mtu_rsp_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gattc_evt_exchange_mtu_rsp_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+#if NRF_SD_BLE_API_VERSION >= 4
+uint32_t ble_gattc_conn_cfg_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gattc_conn_cfg_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+#endif
+#ifdef __cplusplus
+}
+#endif
+
+#endif /*BLE_GATTC_STRUCT_SERIALIZATION_H*/
diff --git a/thirdparty/nRF5_SDK_15.0.0_a53641a/components/serialization/common/struct_ser/ble/ble_gatts_struct_serialization.c b/thirdparty/nRF5_SDK_15.0.0_a53641a/components/serialization/common/struct_ser/ble/ble_gatts_struct_serialization.c
new file mode 100644
index 0000000..476a11d
--- /dev/null
+++ b/thirdparty/nRF5_SDK_15.0.0_a53641a/components/serialization/common/struct_ser/ble/ble_gatts_struct_serialization.c
@@ -0,0 +1,689 @@
+/**
+ * Copyright (c) 2014 - 2018, Nordic Semiconductor ASA
+ *
+ * All rights reserved.
+ *
+ * Redistribution and use in source and binary forms, with or without modification,
+ * are permitted provided that the following conditions are met:
+ *
+ * 1. Redistributions of source code must retain the above copyright notice, this
+ * list of conditions and the following disclaimer.
+ *
+ * 2. Redistributions in binary form, except as embedded into a Nordic
+ * Semiconductor ASA integrated circuit in a product or a software update for
+ * such product, must reproduce the above copyright notice, this list of
+ * conditions and the following disclaimer in the documentation and/or other
+ * materials provided with the distribution.
+ *
+ * 3. Neither the name of Nordic Semiconductor ASA nor the names of its
+ * contributors may be used to endorse or promote products derived from this
+ * software without specific prior written permission.
+ *
+ * 4. This software, with or without modification, must only be used with a
+ * Nordic Semiconductor ASA integrated circuit.
+ *
+ * 5. Any software provided in binary form under this license must not be reverse
+ * engineered, decompiled, modified and/or disassembled.
+ *
+ * THIS SOFTWARE IS PROVIDED BY NORDIC SEMICONDUCTOR ASA "AS IS" AND ANY EXPRESS
+ * OR IMPLIED WARRANTIES, INCLUDING, BUT NOT LIMITED TO, THE IMPLIED WARRANTIES
+ * OF MERCHANTABILITY, NONINFRINGEMENT, AND FITNESS FOR A PARTICULAR PURPOSE ARE
+ * DISCLAIMED. IN NO EVENT SHALL NORDIC SEMICONDUCTOR ASA OR CONTRIBUTORS BE
+ * LIABLE FOR ANY DIRECT, INDIRECT, INCIDENTAL, SPECIAL, EXEMPLARY, OR
+ * CONSEQUENTIAL DAMAGES (INCLUDING, BUT NOT LIMITED TO, PROCUREMENT OF SUBSTITUTE
+ * GOODS OR SERVICES; LOSS OF USE, DATA, OR PROFITS; OR BUSINESS INTERRUPTION)
+ * HOWEVER CAUSED AND ON ANY THEORY OF LIABILITY, WHETHER IN CONTRACT, STRICT
+ * LIABILITY, OR TORT (INCLUDING NEGLIGENCE OR OTHERWISE) ARISING IN ANY WAY OUT
+ * OF THE USE OF THIS SOFTWARE, EVEN IF ADVISED OF THE POSSIBILITY OF SUCH DAMAGE.
+ *
+ */
+#include "ble_gatt_struct_serialization.h"
+#include "ble_gatts_struct_serialization.h"
+#include "ble_gap_struct_serialization.h"
+#include "ble_struct_serialization.h"
+#include "ble_serialization.h"
+#include "app_util.h"
+#include "ble_gatts.h"
+#include "cond_field_serialization.h"
+#include <string.h>
+
+uint32_t ble_gatts_char_pf_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gatts_char_pf_t);
+
+ SER_PUSH_uint8(&p_struct->format);
+ SER_PUSH_int8(&p_struct->exponent);
+ SER_PUSH_uint16(&p_struct->unit);
+ SER_PUSH_uint8(&p_struct->name_space);
+ SER_PUSH_uint16(&p_struct->desc);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gatts_char_pf_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gatts_char_pf_t);
+
+ SER_PULL_uint8(&p_struct->format);
+ SER_PULL_int8(&p_struct->exponent);
+ SER_PULL_uint16(&p_struct->unit);
+ SER_PULL_uint8(&p_struct->name_space);
+ SER_PULL_uint16(&p_struct->desc);
+
+ SER_STRUCT_DEC_END;
+}
+
+uint32_t ble_gatts_attr_md_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gatts_attr_md_t);
+
+ SER_PUSH_FIELD(&p_struct->read_perm, ble_gap_conn_sec_mode_t_enc);
+ SER_PUSH_FIELD(&p_struct->write_perm, ble_gap_conn_sec_mode_t_enc);
+ uint8_t ser_data = (p_struct->vlen & 0x01)
+ | ((p_struct->vloc & 0x03) << 1)
+ | ((p_struct->rd_auth & 0x01) << 3)
+ | ((p_struct->wr_auth & 0x01) << 4);
+ SER_PUSH_uint8(&ser_data);
+
+ // Serializer does not support attributes on stack.
+ if (p_struct->vloc != BLE_GATTS_VLOC_STACK)
+ {
+ err_code = NRF_ERROR_INVALID_PARAM;
+ }
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gatts_attr_md_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gatts_attr_md_t);
+
+ uint8_t ser_data;
+ SER_PULL_FIELD(&p_struct->read_perm, ble_gap_conn_sec_mode_t_dec);
+ SER_PULL_FIELD(&p_struct->write_perm, ble_gap_conn_sec_mode_t_dec);
+ SER_PULL_uint8(&ser_data);
+
+ p_struct->vlen = ser_data & 0x01;
+ p_struct->vloc = (ser_data >> 1) & 0x03;
+ p_struct->rd_auth = (ser_data >> 3) & 0x01;
+ p_struct->wr_auth = (ser_data >> 4) & 0x01;
+
+ SER_STRUCT_DEC_END;
+}
+
+uint32_t ble_gatts_char_md_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gatts_char_md_t);
+
+ SER_PUSH_FIELD(&p_struct->char_props, ble_gatt_char_props_t_enc);
+ SER_PUSH_FIELD(&p_struct->char_ext_props, ble_gatt_char_ext_props_t_enc);
+ SER_PUSH_uint16(&p_struct->char_user_desc_max_size);
+ SER_ERROR_CHECK(p_struct->char_user_desc_size <= BLE_GATTS_VAR_ATTR_LEN_MAX,
+ NRF_ERROR_INVALID_PARAM);
+ SER_PUSH_len16data(p_struct->p_char_user_desc, p_struct->char_user_desc_size);
+ SER_PUSH_COND(p_struct->p_char_pf, ble_gatts_char_pf_t_enc);
+ SER_PUSH_COND(p_struct->p_user_desc_md, ble_gatts_attr_md_t_enc);
+ SER_PUSH_COND(p_struct->p_cccd_md, ble_gatts_attr_md_t_enc);
+ SER_PUSH_COND(p_struct->p_sccd_md, ble_gatts_attr_md_t_enc);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gatts_char_md_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gatts_char_md_t);
+
+ SER_PULL_FIELD(&p_struct->char_props, ble_gatt_char_props_t_dec);
+ SER_PULL_FIELD(&p_struct->char_ext_props, ble_gatt_char_ext_props_t_dec);
+ SER_PULL_uint16(&p_struct->char_user_desc_max_size);
+#if defined(NRF_SD_BLE_API_VERSION) && NRF_SD_BLE_API_VERSION < 4
+ SER_PULL_len16data(&p_struct->p_char_user_desc, &p_struct->char_user_desc_size);
+#else
+ SER_PULL_len16data((uint8_t * * )&p_struct->p_char_user_desc, &p_struct->char_user_desc_size);
+#endif
+ SER_PULL_COND(&p_struct->p_char_pf, ble_gatts_char_pf_t_dec);
+ SER_PULL_COND(&p_struct->p_user_desc_md, ble_gatts_attr_md_t_dec);
+ SER_PULL_COND(&p_struct->p_cccd_md, ble_gatts_attr_md_t_dec);
+ SER_PULL_COND(&p_struct->p_sccd_md, ble_gatts_attr_md_t_dec);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gatts_attr_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gatts_attr_t);
+
+ SER_PUSH_COND(p_struct->p_uuid, ble_uuid_t_enc);
+ SER_PUSH_COND(p_struct->p_attr_md, ble_gatts_attr_md_t_enc);
+ SER_PUSH_uint16(&p_struct->init_offs);
+ SER_PUSH_uint16(&p_struct->max_len);
+ SER_ERROR_CHECK(p_struct->init_len <= BLE_GATTS_VAR_ATTR_LEN_MAX, NRF_ERROR_INVALID_PARAM);
+ SER_PUSH_len16data(p_struct->p_value, p_struct->init_len);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gatts_attr_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gatts_attr_t);
+
+ SER_PULL_COND(&p_struct->p_uuid, ble_uuid_t_dec);
+ SER_PULL_COND(&p_struct->p_attr_md, ble_gatts_attr_md_t_dec);
+ SER_PULL_uint16(&p_struct->init_offs);
+ SER_PULL_uint16(&p_struct->max_len);
+ SER_PULL_len16data(&p_struct->p_value, &p_struct->init_len);
+
+ SER_STRUCT_DEC_END;
+}
+
+uint32_t ble_gatts_char_handles_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gatts_char_handles_t);
+
+ SER_PUSH_uint16(&p_struct->value_handle);
+ SER_PUSH_uint16(&p_struct->user_desc_handle);
+ SER_PUSH_uint16(&p_struct->cccd_handle);
+ SER_PUSH_uint16(&p_struct->sccd_handle);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gatts_char_handles_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gatts_char_handles_t);
+
+ SER_PULL_uint16(&p_struct->value_handle);
+ SER_PULL_uint16(&p_struct->user_desc_handle);
+ SER_PULL_uint16(&p_struct->cccd_handle);
+ SER_PULL_uint16(&p_struct->sccd_handle);
+
+ SER_STRUCT_DEC_END;
+}
+
+uint32_t ble_gatts_hvx_params_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gatts_hvx_params_t);
+
+ SER_PUSH_uint16(&p_struct->handle);
+ SER_PUSH_uint8(&p_struct->type);
+ SER_PUSH_uint16(&p_struct->offset);
+ SER_PUSH_COND(p_struct->p_len, uint16_t_enc);
+ if (p_struct->p_len)
+ {
+ SER_PUSH_buf(p_struct->p_data, *p_struct->p_len);
+ }
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gatts_hvx_params_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gatts_hvx_params_t);
+
+ SER_PULL_uint16(&p_struct->handle);
+ SER_PULL_uint8(&p_struct->type);
+ SER_PULL_uint16(&p_struct->offset);
+ SER_PULL_COND(&p_struct->p_len, uint16_t_dec);
+ if (p_struct->p_len)
+ {
+#if defined(NRF_SD_BLE_API_VERSION) && NRF_SD_BLE_API_VERSION < 4
+ SER_PULL_buf(&p_struct->p_data, *p_struct->p_len, *p_struct->p_len);
+#else
+ SER_PULL_buf((uint8_t**)&p_struct->p_data, *p_struct->p_len, *p_struct->p_len);
+#endif
+ }
+
+ SER_STRUCT_DEC_END;
+}
+
+uint32_t ble_gatts_evt_write_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gatts_evt_write_t);
+
+ SER_PUSH_uint16(&p_struct->handle);
+ SER_PUSH_FIELD(&p_struct->uuid, ble_uuid_t_enc);
+ SER_PUSH_uint8(&p_struct->op);
+ SER_PUSH_uint8(&p_struct->auth_required);
+ SER_PUSH_uint16(&p_struct->offset);
+ SER_PUSH_uint16(&p_struct->len);
+ SER_PUSH_uint8array(p_struct->data, p_struct->len);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gatts_evt_write_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ uint32_t * const p_ext_len,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gatts_evt_write_t);
+
+ SER_PULL_uint16(&p_struct->handle);
+ SER_PULL_FIELD(&p_struct->uuid, ble_uuid_t_dec);
+ SER_PULL_uint8(&p_struct->op);
+ SER_PULL_uint8(&p_struct->auth_required);
+ SER_PULL_uint16(&p_struct->offset);
+ SER_PULL_uint16(&p_struct->len);
+
+ // Data field is defined as 1-element array, so the first element
+ // is always allocated in the structure.
+ SER_ASSERT_LENGTH_LEQ(p_struct->len, *p_ext_len + 1);
+ SER_PULL_uint8array(p_struct->data, p_struct->len);
+ *p_ext_len = (p_struct->len > 1) ? p_struct->len - 1 : 0;
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gatts_evt_read_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gatts_evt_read_t);
+
+ SER_PUSH_uint16(&p_struct->handle);
+ SER_PUSH_FIELD(&p_struct->uuid, ble_uuid_t_enc);
+ SER_PUSH_uint16(&p_struct->offset);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gatts_evt_read_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gatts_evt_read_t);
+
+ SER_PULL_uint16(&p_struct->handle);
+ SER_PULL_FIELD(&p_struct->uuid, ble_uuid_t_dec);
+ SER_PULL_uint16(&p_struct->offset);
+
+ SER_STRUCT_DEC_END;
+}
+
+uint32_t ble_gatts_evt_rw_authorize_request_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gatts_evt_rw_authorize_request_t);
+
+ SER_PUSH_uint8(&p_struct->type);
+
+ switch (p_struct->type)
+ {
+ case BLE_GATTS_AUTHORIZE_TYPE_READ:
+ SER_PUSH_FIELD(&p_struct->request.read, ble_gatts_evt_read_t_enc);
+ break;
+
+ case BLE_GATTS_AUTHORIZE_TYPE_WRITE:
+ SER_PUSH_FIELD(&p_struct->request.write, ble_gatts_evt_write_t_enc);
+ break;
+
+ default:
+ case BLE_GATTS_AUTHORIZE_TYPE_INVALID:
+ err_code = NRF_ERROR_INVALID_PARAM;
+ break;
+ }
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gatts_evt_rw_authorize_request_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ uint32_t * const p_ext_len,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gatts_evt_rw_authorize_request_t);
+
+ SER_PULL_uint8(&p_struct->type);
+
+ switch (p_struct->type)
+ {
+ case BLE_GATTS_AUTHORIZE_TYPE_READ:
+ SER_PULL_FIELD(&p_struct->request.read, ble_gatts_evt_read_t_dec);
+ break;
+
+ case BLE_GATTS_AUTHORIZE_TYPE_WRITE:
+ err_code = ble_gatts_evt_write_t_dec(p_buf,
+ buf_len,
+ p_index,
+ p_ext_len,
+ &p_struct->request.write);
+ SER_ASSERT(err_code == NRF_SUCCESS, err_code);
+ break;
+
+ default:
+ case BLE_GATTS_AUTHORIZE_TYPE_INVALID:
+ return NRF_ERROR_INVALID_DATA;
+ }
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gatts_authorize_params_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gatts_authorize_params_t);
+
+ uint8_t ser_data = p_struct->update & 0x01;
+ SER_PUSH_uint16(&p_struct->gatt_status);
+ SER_PUSH_uint8(&ser_data);
+ SER_PUSH_uint16(&p_struct->offset);
+ SER_PUSH_len16data(p_struct->p_data, p_struct->len);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gatts_authorize_params_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gatts_authorize_params_t);
+
+ uint8_t ser_data;
+ SER_PULL_uint16(&p_struct->gatt_status);
+ SER_PULL_uint8(&ser_data);
+ SER_PULL_uint16(&p_struct->offset);
+ SER_PULL_len16data((uint8_t **) &p_struct->p_data, &p_struct->len);
+
+ p_struct->update = ser_data & 0x01;
+
+ SER_STRUCT_DEC_END;
+}
+
+uint32_t ble_gatts_rw_authorize_reply_params_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gatts_rw_authorize_reply_params_t);
+
+ SER_PUSH_uint8(&p_struct->type);
+ if (p_struct->type == BLE_GATTS_AUTHORIZE_TYPE_READ)
+ {
+ SER_PUSH_FIELD(&p_struct->params.read, ble_gatts_authorize_params_t_enc);
+ }
+ else if (p_struct->type == BLE_GATTS_AUTHORIZE_TYPE_WRITE)
+ {
+ SER_PUSH_FIELD(&p_struct->params.write, ble_gatts_authorize_params_t_enc);
+ }
+ else
+ {
+ return NRF_ERROR_INVALID_PARAM;
+ }
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gatts_rw_authorize_reply_params_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gatts_rw_authorize_reply_params_t);
+
+ SER_PULL_uint8(&p_struct->type);
+ if (p_struct->type == BLE_GATTS_AUTHORIZE_TYPE_READ)
+ {
+ SER_PULL_FIELD(&p_struct->params.read, ble_gatts_authorize_params_t_dec);
+ }
+ else if (p_struct->type == BLE_GATTS_AUTHORIZE_TYPE_WRITE)
+ {
+ SER_PULL_FIELD(&p_struct->params.write, ble_gatts_authorize_params_t_dec);
+ }
+ else
+ {
+ return NRF_ERROR_INVALID_PARAM;
+ }
+
+ SER_STRUCT_DEC_END;
+}
+#if defined(NRF_SD_BLE_API_VERSION) && NRF_SD_BLE_API_VERSION < 4
+uint32_t ble_gatts_enable_params_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gatts_enable_params_t);
+
+ uint8_t ser_data = p_struct->service_changed & 0x01;
+ SER_PUSH_uint8(&ser_data);
+ SER_PUSH_uint32(&p_struct->attr_tab_size);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gatts_enable_params_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gatts_enable_params_t);
+
+ uint8_t ser_data;
+ SER_PULL_uint8(&ser_data);
+ SER_PULL_uint32(&p_struct->attr_tab_size);
+
+ p_struct->service_changed = ser_data & 0x01;
+
+ SER_STRUCT_DEC_END;
+}
+#endif
+
+uint32_t ble_gatts_value_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gatts_value_t);
+
+ SER_PUSH_uint16(&p_struct->offset);
+ SER_PUSH_len16data(p_struct->p_value, p_struct->len);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gatts_value_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gatts_value_t);
+
+ SER_PULL_uint16(&p_struct->offset);
+ SER_PULL_len16data(&p_struct->p_value, &p_struct->len);
+
+ SER_STRUCT_DEC_END;
+}
+
+uint32_t ble_gatts_evt_exchange_mtu_request_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gatts_evt_exchange_mtu_request_t);
+ SER_PUSH_uint16(&p_struct->client_rx_mtu);
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gatts_evt_exchange_mtu_request_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gatts_evt_exchange_mtu_request_t);
+ SER_PULL_uint16(&p_struct->client_rx_mtu);
+ SER_STRUCT_DEC_END;
+}
+
+uint32_t ble_gatts_evt_hvc_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gatts_evt_hvc_t);
+ SER_PUSH_uint16(&p_struct->handle);
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gatts_evt_hvc_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gatts_evt_hvc_t);
+ SER_PULL_uint16(&p_struct->handle);
+ SER_STRUCT_DEC_END;
+}
+
+uint32_t ble_gatts_evt_sys_attr_missing_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gatts_evt_sys_attr_missing_t);
+ SER_PUSH_uint8(&p_struct->hint);
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gatts_evt_sys_attr_missing_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gatts_evt_sys_attr_missing_t);
+ SER_PULL_uint8(&p_struct->hint);
+ SER_STRUCT_DEC_END;
+}
+
+uint32_t ble_gatts_evt_timeout_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gatts_evt_timeout_t);
+ SER_PUSH_uint8(&p_struct->src);
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gatts_evt_timeout_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gatts_evt_timeout_t);
+ SER_PULL_uint8(&p_struct->src);
+ SER_STRUCT_DEC_END;
+}
+
+#if NRF_SD_BLE_API_VERSION >= 4
+uint32_t ble_gatts_conn_cfg_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gatts_conn_cfg_t);
+ SER_PUSH_uint8(&p_struct->hvn_tx_queue_size);
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gatts_conn_cfg_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gatts_conn_cfg_t);
+ SER_PULL_uint8(&p_struct->hvn_tx_queue_size);
+ SER_STRUCT_DEC_END;
+}
+
+uint32_t ble_gatts_cfg_service_changed_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gatts_cfg_service_changed_t);
+ uint8_t service_changed = p_struct->service_changed;
+ SER_PUSH_uint8(&service_changed);
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gatts_cfg_service_changed_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gatts_cfg_service_changed_t);
+ uint8_t service_changed;
+ SER_PULL_uint8(&service_changed);
+ p_struct->service_changed = service_changed;
+ SER_STRUCT_DEC_END;
+}
+uint32_t ble_gatts_cfg_attr_tab_size_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_gatts_cfg_attr_tab_size_t);
+ SER_PUSH_uint32(&p_struct->attr_tab_size);
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_gatts_cfg_attr_tab_size_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_gatts_cfg_attr_tab_size_t);
+ SER_PULL_uint32(&p_struct->attr_tab_size);
+ SER_STRUCT_DEC_END;
+}
+
+
+#endif
diff --git a/thirdparty/nRF5_SDK_15.0.0_a53641a/components/serialization/common/struct_ser/ble/ble_gatts_struct_serialization.h b/thirdparty/nRF5_SDK_15.0.0_a53641a/components/serialization/common/struct_ser/ble/ble_gatts_struct_serialization.h
new file mode 100644
index 0000000..4a93913
--- /dev/null
+++ b/thirdparty/nRF5_SDK_15.0.0_a53641a/components/serialization/common/struct_ser/ble/ble_gatts_struct_serialization.h
@@ -0,0 +1,259 @@
+/**
+ * Copyright (c) 2014 - 2018, Nordic Semiconductor ASA
+ *
+ * All rights reserved.
+ *
+ * Redistribution and use in source and binary forms, with or without modification,
+ * are permitted provided that the following conditions are met:
+ *
+ * 1. Redistributions of source code must retain the above copyright notice, this
+ * list of conditions and the following disclaimer.
+ *
+ * 2. Redistributions in binary form, except as embedded into a Nordic
+ * Semiconductor ASA integrated circuit in a product or a software update for
+ * such product, must reproduce the above copyright notice, this list of
+ * conditions and the following disclaimer in the documentation and/or other
+ * materials provided with the distribution.
+ *
+ * 3. Neither the name of Nordic Semiconductor ASA nor the names of its
+ * contributors may be used to endorse or promote products derived from this
+ * software without specific prior written permission.
+ *
+ * 4. This software, with or without modification, must only be used with a
+ * Nordic Semiconductor ASA integrated circuit.
+ *
+ * 5. Any software provided in binary form under this license must not be reverse
+ * engineered, decompiled, modified and/or disassembled.
+ *
+ * THIS SOFTWARE IS PROVIDED BY NORDIC SEMICONDUCTOR ASA "AS IS" AND ANY EXPRESS
+ * OR IMPLIED WARRANTIES, INCLUDING, BUT NOT LIMITED TO, THE IMPLIED WARRANTIES
+ * OF MERCHANTABILITY, NONINFRINGEMENT, AND FITNESS FOR A PARTICULAR PURPOSE ARE
+ * DISCLAIMED. IN NO EVENT SHALL NORDIC SEMICONDUCTOR ASA OR CONTRIBUTORS BE
+ * LIABLE FOR ANY DIRECT, INDIRECT, INCIDENTAL, SPECIAL, EXEMPLARY, OR
+ * CONSEQUENTIAL DAMAGES (INCLUDING, BUT NOT LIMITED TO, PROCUREMENT OF SUBSTITUTE
+ * GOODS OR SERVICES; LOSS OF USE, DATA, OR PROFITS; OR BUSINESS INTERRUPTION)
+ * HOWEVER CAUSED AND ON ANY THEORY OF LIABILITY, WHETHER IN CONTRACT, STRICT
+ * LIABILITY, OR TORT (INCLUDING NEGLIGENCE OR OTHERWISE) ARISING IN ANY WAY OUT
+ * OF THE USE OF THIS SOFTWARE, EVEN IF ADVISED OF THE POSSIBILITY OF SUCH DAMAGE.
+ *
+ */
+#ifndef BLE_GATTS_STRUCT_SERIALIZATION_H
+#define BLE_GATTS_STRUCT_SERIALIZATION_H
+
+#include "ble_gatts.h"
+
+#ifdef __cplusplus
+extern "C" {
+#endif
+
+uint32_t ble_gatts_char_pf_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gatts_char_pf_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_gatts_attr_md_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gatts_attr_md_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_gatts_char_md_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gatts_char_md_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_gatts_attr_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gatts_attr_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_gatts_char_handles_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gatts_char_handles_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_gatts_evt_write_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gatts_evt_write_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ uint32_t * const p_ext_len,
+ void * const p_void_struct);
+
+uint32_t ble_gatts_hvx_params_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gatts_hvx_params_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_gatts_evt_read_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gatts_evt_read_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_gatts_evt_rw_authorize_request_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gatts_evt_rw_authorize_request_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ uint32_t * const p_ext_len,
+ void * const p_void_struct);
+
+uint32_t ble_gatts_authorize_params_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gatts_authorize_params_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_gatts_rw_authorize_reply_params_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gatts_rw_authorize_reply_params_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+#if defined(NRF_SD_BLE_API_VERSION) && NRF_SD_BLE_API_VERSION < 4
+uint32_t ble_gatts_enable_params_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gatts_enable_params_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+#endif
+
+uint32_t ble_gatts_value_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gatts_value_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_gatts_evt_exchange_mtu_request_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gatts_evt_exchange_mtu_request_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_gatts_evt_hvc_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gatts_evt_hvc_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_gatts_evt_sys_attr_missing_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gatts_evt_sys_attr_missing_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_gatts_evt_timeout_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gatts_evt_timeout_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+#if NRF_SD_BLE_API_VERSION >= 4
+uint32_t ble_gatts_conn_cfg_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gatts_conn_cfg_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_gatts_cfg_service_changed_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gatts_cfg_service_changed_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_gatts_cfg_attr_tab_size_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_gatts_cfg_attr_tab_size_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+#endif
+#ifdef __cplusplus
+}
+#endif
+
+#endif /* BLE_GATTS_STRUCT_SERIALIZATION_H */
diff --git a/thirdparty/nRF5_SDK_15.0.0_a53641a/components/serialization/common/struct_ser/ble/ble_l2cap_struct_serialization.c b/thirdparty/nRF5_SDK_15.0.0_a53641a/components/serialization/common/struct_ser/ble/ble_l2cap_struct_serialization.c
new file mode 100644
index 0000000..cc48f80
--- /dev/null
+++ b/thirdparty/nRF5_SDK_15.0.0_a53641a/components/serialization/common/struct_ser/ble/ble_l2cap_struct_serialization.c
@@ -0,0 +1,227 @@
+/**
+ * Copyright (c) 2014 - 2018, Nordic Semiconductor ASA
+ *
+ * All rights reserved.
+ *
+ * Redistribution and use in source and binary forms, with or without modification,
+ * are permitted provided that the following conditions are met:
+ *
+ * 1. Redistributions of source code must retain the above copyright notice, this
+ * list of conditions and the following disclaimer.
+ *
+ * 2. Redistributions in binary form, except as embedded into a Nordic
+ * Semiconductor ASA integrated circuit in a product or a software update for
+ * such product, must reproduce the above copyright notice, this list of
+ * conditions and the following disclaimer in the documentation and/or other
+ * materials provided with the distribution.
+ *
+ * 3. Neither the name of Nordic Semiconductor ASA nor the names of its
+ * contributors may be used to endorse or promote products derived from this
+ * software without specific prior written permission.
+ *
+ * 4. This software, with or without modification, must only be used with a
+ * Nordic Semiconductor ASA integrated circuit.
+ *
+ * 5. Any software provided in binary form under this license must not be reverse
+ * engineered, decompiled, modified and/or disassembled.
+ *
+ * THIS SOFTWARE IS PROVIDED BY NORDIC SEMICONDUCTOR ASA "AS IS" AND ANY EXPRESS
+ * OR IMPLIED WARRANTIES, INCLUDING, BUT NOT LIMITED TO, THE IMPLIED WARRANTIES
+ * OF MERCHANTABILITY, NONINFRINGEMENT, AND FITNESS FOR A PARTICULAR PURPOSE ARE
+ * DISCLAIMED. IN NO EVENT SHALL NORDIC SEMICONDUCTOR ASA OR CONTRIBUTORS BE
+ * LIABLE FOR ANY DIRECT, INDIRECT, INCIDENTAL, SPECIAL, EXEMPLARY, OR
+ * CONSEQUENTIAL DAMAGES (INCLUDING, BUT NOT LIMITED TO, PROCUREMENT OF SUBSTITUTE
+ * GOODS OR SERVICES; LOSS OF USE, DATA, OR PROFITS; OR BUSINESS INTERRUPTION)
+ * HOWEVER CAUSED AND ON ANY THEORY OF LIABILITY, WHETHER IN CONTRACT, STRICT
+ * LIABILITY, OR TORT (INCLUDING NEGLIGENCE OR OTHERWISE) ARISING IN ANY WAY OUT
+ * OF THE USE OF THIS SOFTWARE, EVEN IF ADVISED OF THE POSSIBILITY OF SUCH DAMAGE.
+ *
+ */
+#include "ble_l2cap_struct_serialization.h"
+#include "ble_struct_serialization.h"
+#include "ble_serialization.h"
+#include "app_util.h"
+#include "cond_field_serialization.h"
+#include <string.h>
+
+#if defined(NRF_SD_BLE_API_VERSION) && NRF_SD_BLE_API_VERSION < 4
+uint32_t ble_l2cap_header_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_l2cap_header_t);
+
+ SER_PUSH_uint16(&p_struct->len);
+ SER_PUSH_uint16(&p_struct->cid);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_l2cap_header_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_l2cap_header_t);
+
+ SER_PULL_uint16(&p_struct->len);
+ SER_PULL_uint16(&p_struct->cid);
+
+ SER_STRUCT_DEC_END;
+}
+
+uint32_t ble_l2cap_evt_rx_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_l2cap_evt_rx_t);
+
+ SER_PUSH_FIELD(&p_struct->header, ble_l2cap_header_t_enc);
+ SER_PUSH_uint8array(p_struct->data, p_struct->header.len);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_l2cap_evt_rx_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ uint32_t * const p_ext_len,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_l2cap_evt_rx_t);
+
+ SER_PULL_FIELD(&p_struct->header, ble_l2cap_header_t_dec);
+
+ uint32_t data_len = (SUB1(p_struct->header.len));
+ SER_ASSERT_LENGTH_LEQ(data_len, *p_ext_len);
+
+ SER_PULL_uint8array(p_struct->data, p_struct->header.len);
+
+ *p_ext_len = data_len;
+ SER_STRUCT_DEC_END;
+}
+#endif
+
+#if NRF_SD_BLE_API_VERSION >= 5
+uint32_t ble_l2cap_conn_cfg_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_l2cap_conn_cfg_t);
+
+ SER_PUSH_uint16(&p_struct->rx_mps);
+ SER_PUSH_uint16(&p_struct->tx_mps);
+ SER_PUSH_uint8(&p_struct->rx_queue_size);
+ SER_PUSH_uint8(&p_struct->tx_queue_size);
+ SER_PUSH_uint8(&p_struct->ch_count);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_l2cap_conn_cfg_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_l2cap_conn_cfg_t);
+
+ SER_PULL_uint16(&p_struct->rx_mps);
+ SER_PULL_uint16(&p_struct->tx_mps);
+ SER_PULL_uint8(&p_struct->rx_queue_size);
+ SER_PULL_uint8(&p_struct->tx_queue_size);
+ SER_PULL_uint8(&p_struct->ch_count);
+
+ SER_STRUCT_DEC_END;
+}
+
+uint32_t ble_l2cap_ch_rx_params_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_l2cap_ch_rx_params_t);
+
+ SER_PUSH_uint16(&p_struct->rx_mtu);
+ SER_PUSH_uint16(&p_struct->rx_mps);
+ SER_PUSH_uint16(&p_struct->sdu_buf.len);
+ SER_PUSH_uint32(&p_struct->sdu_buf.p_data);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_l2cap_ch_rx_params_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_l2cap_ch_rx_params_t);
+
+ SER_PULL_uint16(&p_struct->rx_mtu);
+ SER_PULL_uint16(&p_struct->rx_mps);
+ SER_PULL_uint16(&p_struct->sdu_buf.len);
+ SER_PULL_uint32(&p_struct->sdu_buf.p_data);
+
+ SER_STRUCT_DEC_END;
+}
+
+uint32_t ble_l2cap_ch_setup_params_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_l2cap_ch_setup_params_t);
+
+ SER_PUSH_FIELD(&p_struct->rx_params, ble_l2cap_ch_rx_params_t_enc);
+ SER_PUSH_uint16(&p_struct->le_psm);
+ SER_PUSH_uint16(&p_struct->status);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_l2cap_ch_setup_params_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_l2cap_ch_setup_params_t);
+
+ SER_PULL_FIELD(&p_struct->rx_params, ble_l2cap_ch_rx_params_t_dec);
+ SER_PULL_uint16(&p_struct->le_psm);
+ SER_PULL_uint16(&p_struct->status);
+
+ SER_STRUCT_DEC_END;
+}
+
+uint32_t ble_l2cap_ch_tx_params_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_l2cap_ch_tx_params_t);
+
+ SER_PUSH_uint16(&p_struct->tx_mtu);
+ SER_PUSH_uint16(&p_struct->peer_mps);
+ SER_PUSH_uint16(&p_struct->tx_mps);
+ SER_PUSH_uint16(&p_struct->credits);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_l2cap_ch_tx_params_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_l2cap_ch_tx_params_t);
+
+ SER_PULL_uint16(&p_struct->tx_mtu);
+ SER_PULL_uint16(&p_struct->peer_mps);
+ SER_PULL_uint16(&p_struct->tx_mps);
+ SER_PULL_uint16(&p_struct->credits);
+
+ SER_STRUCT_DEC_END;
+}
+#endif //NRF_SD_BLE_API_VERSION >= 5
diff --git a/thirdparty/nRF5_SDK_15.0.0_a53641a/components/serialization/common/struct_ser/ble/ble_l2cap_struct_serialization.h b/thirdparty/nRF5_SDK_15.0.0_a53641a/components/serialization/common/struct_ser/ble/ble_l2cap_struct_serialization.h
new file mode 100644
index 0000000..a8c7bc1
--- /dev/null
+++ b/thirdparty/nRF5_SDK_15.0.0_a53641a/components/serialization/common/struct_ser/ble/ble_l2cap_struct_serialization.h
@@ -0,0 +1,119 @@
+/**
+ * Copyright (c) 2014 - 2018, Nordic Semiconductor ASA
+ *
+ * All rights reserved.
+ *
+ * Redistribution and use in source and binary forms, with or without modification,
+ * are permitted provided that the following conditions are met:
+ *
+ * 1. Redistributions of source code must retain the above copyright notice, this
+ * list of conditions and the following disclaimer.
+ *
+ * 2. Redistributions in binary form, except as embedded into a Nordic
+ * Semiconductor ASA integrated circuit in a product or a software update for
+ * such product, must reproduce the above copyright notice, this list of
+ * conditions and the following disclaimer in the documentation and/or other
+ * materials provided with the distribution.
+ *
+ * 3. Neither the name of Nordic Semiconductor ASA nor the names of its
+ * contributors may be used to endorse or promote products derived from this
+ * software without specific prior written permission.
+ *
+ * 4. This software, with or without modification, must only be used with a
+ * Nordic Semiconductor ASA integrated circuit.
+ *
+ * 5. Any software provided in binary form under this license must not be reverse
+ * engineered, decompiled, modified and/or disassembled.
+ *
+ * THIS SOFTWARE IS PROVIDED BY NORDIC SEMICONDUCTOR ASA "AS IS" AND ANY EXPRESS
+ * OR IMPLIED WARRANTIES, INCLUDING, BUT NOT LIMITED TO, THE IMPLIED WARRANTIES
+ * OF MERCHANTABILITY, NONINFRINGEMENT, AND FITNESS FOR A PARTICULAR PURPOSE ARE
+ * DISCLAIMED. IN NO EVENT SHALL NORDIC SEMICONDUCTOR ASA OR CONTRIBUTORS BE
+ * LIABLE FOR ANY DIRECT, INDIRECT, INCIDENTAL, SPECIAL, EXEMPLARY, OR
+ * CONSEQUENTIAL DAMAGES (INCLUDING, BUT NOT LIMITED TO, PROCUREMENT OF SUBSTITUTE
+ * GOODS OR SERVICES; LOSS OF USE, DATA, OR PROFITS; OR BUSINESS INTERRUPTION)
+ * HOWEVER CAUSED AND ON ANY THEORY OF LIABILITY, WHETHER IN CONTRACT, STRICT
+ * LIABILITY, OR TORT (INCLUDING NEGLIGENCE OR OTHERWISE) ARISING IN ANY WAY OUT
+ * OF THE USE OF THIS SOFTWARE, EVEN IF ADVISED OF THE POSSIBILITY OF SUCH DAMAGE.
+ *
+ */
+#ifndef BLE_L2CAP_STRUCT_SERIALIZATION_H
+#define BLE_L2CAP_STRUCT_SERIALIZATION_H
+
+#ifndef S112
+#include "ble_l2cap.h"
+
+#ifdef __cplusplus
+extern "C" {
+#endif
+
+#if defined(NRF_SD_BLE_API_VERSION) && NRF_SD_BLE_API_VERSION < 4
+uint32_t ble_l2cap_header_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_l2cap_header_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_l2cap_evt_rx_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_l2cap_evt_rx_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ uint32_t * const p_ext_len,
+ void * const p_void_struct);
+#endif
+
+#if NRF_SD_BLE_API_VERSION >= 5
+uint32_t ble_l2cap_conn_cfg_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_l2cap_conn_cfg_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_l2cap_ch_rx_params_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_l2cap_ch_rx_params_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_l2cap_ch_setup_params_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_l2cap_ch_setup_params_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_l2cap_ch_tx_params_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_l2cap_ch_tx_params_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+#endif
+#endif
+#ifdef __cplusplus
+}
+#endif
+
+#endif /*BLE_L2CAP_STRUCT_SERIALIZATION_H*/
diff --git a/thirdparty/nRF5_SDK_15.0.0_a53641a/components/serialization/common/struct_ser/ble/ble_struct_serialization.c b/thirdparty/nRF5_SDK_15.0.0_a53641a/components/serialization/common/struct_ser/ble/ble_struct_serialization.c
new file mode 100644
index 0000000..5687801
--- /dev/null
+++ b/thirdparty/nRF5_SDK_15.0.0_a53641a/components/serialization/common/struct_ser/ble/ble_struct_serialization.c
@@ -0,0 +1,500 @@
+/**
+ * Copyright (c) 2014 - 2018, Nordic Semiconductor ASA
+ *
+ * All rights reserved.
+ *
+ * Redistribution and use in source and binary forms, with or without modification,
+ * are permitted provided that the following conditions are met:
+ *
+ * 1. Redistributions of source code must retain the above copyright notice, this
+ * list of conditions and the following disclaimer.
+ *
+ * 2. Redistributions in binary form, except as embedded into a Nordic
+ * Semiconductor ASA integrated circuit in a product or a software update for
+ * such product, must reproduce the above copyright notice, this list of
+ * conditions and the following disclaimer in the documentation and/or other
+ * materials provided with the distribution.
+ *
+ * 3. Neither the name of Nordic Semiconductor ASA nor the names of its
+ * contributors may be used to endorse or promote products derived from this
+ * software without specific prior written permission.
+ *
+ * 4. This software, with or without modification, must only be used with a
+ * Nordic Semiconductor ASA integrated circuit.
+ *
+ * 5. Any software provided in binary form under this license must not be reverse
+ * engineered, decompiled, modified and/or disassembled.
+ *
+ * THIS SOFTWARE IS PROVIDED BY NORDIC SEMICONDUCTOR ASA "AS IS" AND ANY EXPRESS
+ * OR IMPLIED WARRANTIES, INCLUDING, BUT NOT LIMITED TO, THE IMPLIED WARRANTIES
+ * OF MERCHANTABILITY, NONINFRINGEMENT, AND FITNESS FOR A PARTICULAR PURPOSE ARE
+ * DISCLAIMED. IN NO EVENT SHALL NORDIC SEMICONDUCTOR ASA OR CONTRIBUTORS BE
+ * LIABLE FOR ANY DIRECT, INDIRECT, INCIDENTAL, SPECIAL, EXEMPLARY, OR
+ * CONSEQUENTIAL DAMAGES (INCLUDING, BUT NOT LIMITED TO, PROCUREMENT OF SUBSTITUTE
+ * GOODS OR SERVICES; LOSS OF USE, DATA, OR PROFITS; OR BUSINESS INTERRUPTION)
+ * HOWEVER CAUSED AND ON ANY THEORY OF LIABILITY, WHETHER IN CONTRACT, STRICT
+ * LIABILITY, OR TORT (INCLUDING NEGLIGENCE OR OTHERWISE) ARISING IN ANY WAY OUT
+ * OF THE USE OF THIS SOFTWARE, EVEN IF ADVISED OF THE POSSIBILITY OF SUCH DAMAGE.
+ *
+ */
+#include "ble_struct_serialization.h"
+#include "ble_gap_struct_serialization.h"
+#include "ble_gatt_struct_serialization.h"
+#include "ble_gatts_struct_serialization.h"
+#include "ble_serialization.h"
+#include "app_util.h"
+#include "ble_types.h"
+#include "ble.h"
+#include "cond_field_serialization.h"
+#ifdef SER_CONNECTIVITY
+#include "conn_ble_gap_sec_keys.h"
+#endif
+#include <string.h>
+
+
+uint32_t ble_uuid_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_uuid_t);
+
+ SER_PUSH_uint16(&p_struct->uuid);
+ SER_PUSH_uint8(&p_struct->type);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_uuid_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_uuid_t);
+
+ SER_PULL_uint16(&p_struct->uuid);
+ SER_PULL_uint8(&p_struct->type);
+
+ SER_STRUCT_DEC_END;
+}
+
+uint32_t ble_uuid128_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_uuid128_t);
+ SER_PUSH_uint8array(p_struct->uuid128, sizeof (p_struct->uuid128));
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_uuid128_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_uuid128_t);
+ SER_PULL_uint8array(p_struct->uuid128, sizeof (p_struct->uuid128));
+ SER_STRUCT_DEC_END;
+}
+
+#if defined(NRF_SD_BLE_API_VERSION) && NRF_SD_BLE_API_VERSION < 4
+uint32_t ble_enable_params_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_enable_params_t);
+
+ SER_PUSH_FIELD(&p_struct->common_enable_params, ble_common_enable_params_t_enc);
+ SER_PUSH_FIELD(&p_struct->gap_enable_params, ble_gap_enable_params_t_enc);
+ SER_PUSH_FIELD(&p_struct->gatt_enable_params, ble_gatt_enable_params_t_enc);
+ SER_PUSH_FIELD(&p_struct->gatts_enable_params, ble_gatts_enable_params_t_enc);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_enable_params_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_enable_params_t);
+
+ SER_PULL_FIELD(&p_struct->common_enable_params, ble_common_enable_params_t_dec);
+ SER_PULL_FIELD(&p_struct->gap_enable_params, ble_gap_enable_params_t_dec);
+ SER_PULL_FIELD(&p_struct->gatt_enable_params, ble_gatt_enable_params_t_dec);
+ SER_PULL_FIELD(&p_struct->gatts_enable_params, ble_gatts_enable_params_t_dec);
+
+ SER_STRUCT_DEC_END;
+}
+
+uint32_t ble_conn_bw_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_conn_bw_t);
+
+ SER_PUSH_uint8(&p_struct->conn_bw_rx);
+ SER_PUSH_uint8(&p_struct->conn_bw_tx);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_conn_bw_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_conn_bw_t);
+
+ SER_PULL_uint8(&p_struct->conn_bw_rx);
+ SER_PULL_uint8(&p_struct->conn_bw_tx);
+
+ SER_STRUCT_DEC_END;
+}
+
+uint32_t ble_common_opt_conn_bw_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_common_opt_conn_bw_t);
+
+ SER_PUSH_uint8(&p_struct->role);
+ SER_PUSH_FIELD(&p_struct->conn_bw, ble_conn_bw_t_enc);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_common_opt_conn_bw_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_common_opt_conn_bw_t);
+
+ SER_PULL_uint8(&p_struct->role);
+ SER_PULL_FIELD(&p_struct->conn_bw, ble_conn_bw_t_dec);
+
+ SER_STRUCT_DEC_END;
+}
+
+uint32_t ble_conn_bw_count_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_conn_bw_count_t);
+
+ SER_PUSH_uint8(&p_struct->high_count);
+ SER_PUSH_uint8(&p_struct->mid_count);
+ SER_PUSH_uint8(&p_struct->low_count);
+
+ SER_STRUCT_DEC_END;
+}
+
+uint32_t ble_conn_bw_count_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_conn_bw_count_t);
+
+ SER_PULL_uint8(&p_struct->high_count);
+ SER_PULL_uint8(&p_struct->mid_count);
+ SER_PULL_uint8(&p_struct->low_count);
+
+ SER_STRUCT_DEC_END;
+}
+
+uint32_t ble_conn_bw_counts_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_conn_bw_counts_t);
+
+ SER_PUSH_FIELD(&p_struct->tx_counts, ble_conn_bw_count_t_enc);
+ SER_PUSH_FIELD(&p_struct->rx_counts, ble_conn_bw_count_t_enc);
+
+ SER_STRUCT_DEC_END;
+}
+
+uint32_t ble_conn_bw_counts_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_conn_bw_counts_t);
+
+ SER_PULL_FIELD(&p_struct->tx_counts, ble_conn_bw_count_t_dec);
+ SER_PULL_FIELD(&p_struct->rx_counts, ble_conn_bw_count_t_dec);
+
+ SER_STRUCT_DEC_END;
+}
+
+uint32_t ble_common_enable_params_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_common_enable_params_t);
+
+ SER_PUSH_uint16(&p_struct->vs_uuid_count);
+ SER_PUSH_COND(p_struct->p_conn_bw_counts, ble_conn_bw_counts_t_enc);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_common_enable_params_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_common_enable_params_t);
+
+ SER_PULL_uint16(&p_struct->vs_uuid_count);
+ SER_PULL_COND(&p_struct->p_conn_bw_counts, ble_conn_bw_counts_t_dec);
+
+ SER_STRUCT_DEC_END;
+}
+#endif
+uint32_t ble_common_opt_pa_lna_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_common_opt_pa_lna_t);
+
+ SER_PUSH_FIELD(&p_struct->pa_cfg, ble_pa_lna_cfg_t_enc);
+ SER_PUSH_FIELD(&p_struct->lna_cfg, ble_pa_lna_cfg_t_enc);
+ SER_PUSH_uint8(&p_struct->ppi_ch_id_set);
+ SER_PUSH_uint8(&p_struct->ppi_ch_id_clr);
+ SER_PUSH_uint8(&p_struct->gpiote_ch_id);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_common_opt_pa_lna_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_common_opt_pa_lna_t);
+
+ SER_PULL_FIELD(&p_struct->pa_cfg, ble_pa_lna_cfg_t_dec);
+ SER_PULL_FIELD(&p_struct->lna_cfg, ble_pa_lna_cfg_t_dec);
+ SER_PULL_uint8(&p_struct->ppi_ch_id_set);
+ SER_PULL_uint8(&p_struct->ppi_ch_id_clr);
+ SER_PULL_uint8(&p_struct->gpiote_ch_id);
+
+ SER_STRUCT_DEC_END;
+}
+
+
+uint32_t ble_pa_lna_cfg_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_pa_lna_cfg_t);
+
+ uint8_t ser_data = (p_struct->enable & 0x01)
+ | ((p_struct->active_high & 0x01) << 1)
+ | ((p_struct->gpio_pin & 0x3F) << 2);
+ SER_PUSH_uint8(&ser_data);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_pa_lna_cfg_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_pa_lna_cfg_t);
+
+ uint8_t ser_data;
+ SER_PULL_uint8(&ser_data);
+ p_struct->enable = ser_data & 0x01;
+ p_struct->active_high = (ser_data >> 1) & 0x01;
+ p_struct->gpio_pin = (ser_data >> 2) & 0x3F;
+
+ SER_STRUCT_DEC_END;
+}
+
+
+uint32_t ble_user_mem_block_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_user_mem_block_t);
+
+ SER_PUSH_uint16(&p_struct->len);
+ SER_PUSH_COND(p_struct->p_mem, NULL);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_user_mem_block_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_user_mem_block_t);
+
+ SER_PULL_uint16(&p_struct->len);
+ SER_PULL_COND(&p_struct->p_mem, NULL);
+
+ SER_STRUCT_DEC_END;
+}
+
+uint32_t ble_version_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_version_t);
+
+ SER_PUSH_uint8(&p_struct->version_number);
+ SER_PUSH_uint16(&p_struct->company_id);
+ SER_PUSH_uint16(&p_struct->subversion_number);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_version_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_version_t);
+
+ SER_PULL_uint8(&p_struct->version_number);
+ SER_PULL_uint16(&p_struct->company_id);
+ SER_PULL_uint16(&p_struct->subversion_number);
+
+ SER_STRUCT_DEC_END;
+}
+#if defined(NRF_SD_BLE_API_VERSION) && NRF_SD_BLE_API_VERSION < 4
+uint32_t ble_evt_data_length_changed_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_evt_data_length_changed_t);
+
+ SER_PUSH_uint16(&p_struct->max_tx_octets);
+ SER_PUSH_uint16(&p_struct->max_tx_time);
+ SER_PUSH_uint16(&p_struct->max_rx_octets);
+ SER_PUSH_uint16(&p_struct->max_rx_time);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_evt_data_length_changed_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_evt_data_length_changed_t);
+
+ SER_PULL_uint16(&p_struct->max_tx_octets);
+ SER_PULL_uint16(&p_struct->max_tx_time);
+ SER_PULL_uint16(&p_struct->max_rx_octets);
+ SER_PULL_uint16(&p_struct->max_rx_time);
+
+ SER_STRUCT_DEC_END;
+}
+#endif
+uint32_t ble_common_opt_conn_evt_ext_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_common_opt_conn_evt_ext_t);
+
+ uint8_t ser_data = p_struct->enable & 0x01;
+ SER_PUSH_uint8(&ser_data);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_common_opt_conn_evt_ext_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_common_opt_conn_evt_ext_t);
+
+ uint8_t ser_data;
+ SER_PULL_uint8(&ser_data);
+ p_struct->enable = ser_data & 0x01;
+
+ SER_STRUCT_DEC_END;
+}
+#if NRF_SD_BLE_API_VERSION >= 4
+uint32_t ble_common_cfg_vs_uuid_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_common_cfg_vs_uuid_t);
+
+ SER_PUSH_uint8(&p_struct->vs_uuid_count);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_common_cfg_vs_uuid_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_common_cfg_vs_uuid_t);
+
+ SER_PULL_uint8(&p_struct->vs_uuid_count);
+
+ SER_STRUCT_DEC_END;
+}
+
+#endif
+
+#if defined(NRF_SD_BLE_API_VERSION) && NRF_SD_BLE_API_VERSION > 4
+uint32_t ble_data_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(ble_data_t);
+
+ uint32_t buf_id = (uint32_t)p_struct->p_data;
+ SER_PUSH_uint32(&buf_id);
+ SER_PUSH_len16data(p_struct->p_data, p_struct->len);
+
+ SER_STRUCT_ENC_END;
+}
+
+uint32_t ble_data_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(ble_data_t);
+
+ uint32_t buf_id;
+ SER_PULL_uint32(&buf_id);
+#if defined(SER_CONNECTIVITY) && NRF_SD_BLE_API_VERSION > 5
+ if (buf_id && (p_struct->p_data == NULL))
+ {
+ p_struct->p_data = conn_ble_gap_ble_data_buf_alloc(buf_id);
+ }
+#endif
+ SER_PULL_len16data(&p_struct->p_data, &p_struct->len);
+
+ SER_STRUCT_DEC_END;
+}
+#endif
diff --git a/thirdparty/nRF5_SDK_15.0.0_a53641a/components/serialization/common/struct_ser/ble/ble_struct_serialization.h b/thirdparty/nRF5_SDK_15.0.0_a53641a/components/serialization/common/struct_ser/ble/ble_struct_serialization.h
new file mode 100644
index 0000000..66c05a9
--- /dev/null
+++ b/thirdparty/nRF5_SDK_15.0.0_a53641a/components/serialization/common/struct_ser/ble/ble_struct_serialization.h
@@ -0,0 +1,217 @@
+/**
+ * Copyright (c) 2014 - 2018, Nordic Semiconductor ASA
+ *
+ * All rights reserved.
+ *
+ * Redistribution and use in source and binary forms, with or without modification,
+ * are permitted provided that the following conditions are met:
+ *
+ * 1. Redistributions of source code must retain the above copyright notice, this
+ * list of conditions and the following disclaimer.
+ *
+ * 2. Redistributions in binary form, except as embedded into a Nordic
+ * Semiconductor ASA integrated circuit in a product or a software update for
+ * such product, must reproduce the above copyright notice, this list of
+ * conditions and the following disclaimer in the documentation and/or other
+ * materials provided with the distribution.
+ *
+ * 3. Neither the name of Nordic Semiconductor ASA nor the names of its
+ * contributors may be used to endorse or promote products derived from this
+ * software without specific prior written permission.
+ *
+ * 4. This software, with or without modification, must only be used with a
+ * Nordic Semiconductor ASA integrated circuit.
+ *
+ * 5. Any software provided in binary form under this license must not be reverse
+ * engineered, decompiled, modified and/or disassembled.
+ *
+ * THIS SOFTWARE IS PROVIDED BY NORDIC SEMICONDUCTOR ASA "AS IS" AND ANY EXPRESS
+ * OR IMPLIED WARRANTIES, INCLUDING, BUT NOT LIMITED TO, THE IMPLIED WARRANTIES
+ * OF MERCHANTABILITY, NONINFRINGEMENT, AND FITNESS FOR A PARTICULAR PURPOSE ARE
+ * DISCLAIMED. IN NO EVENT SHALL NORDIC SEMICONDUCTOR ASA OR CONTRIBUTORS BE
+ * LIABLE FOR ANY DIRECT, INDIRECT, INCIDENTAL, SPECIAL, EXEMPLARY, OR
+ * CONSEQUENTIAL DAMAGES (INCLUDING, BUT NOT LIMITED TO, PROCUREMENT OF SUBSTITUTE
+ * GOODS OR SERVICES; LOSS OF USE, DATA, OR PROFITS; OR BUSINESS INTERRUPTION)
+ * HOWEVER CAUSED AND ON ANY THEORY OF LIABILITY, WHETHER IN CONTRACT, STRICT
+ * LIABILITY, OR TORT (INCLUDING NEGLIGENCE OR OTHERWISE) ARISING IN ANY WAY OUT
+ * OF THE USE OF THIS SOFTWARE, EVEN IF ADVISED OF THE POSSIBILITY OF SUCH DAMAGE.
+ *
+ */
+#ifndef BLE_STRUCT_SERIALIZATION_H__
+#define BLE_STRUCT_SERIALIZATION_H__
+
+#include "ble_types.h"
+
+#ifdef __cplusplus
+extern "C" {
+#endif
+
+
+uint32_t ble_uuid_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_uuid_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_uuid128_t_enc(const void * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_uuid128_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_enable_params_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_enable_params_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_conn_bw_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_conn_bw_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_common_opt_conn_bw_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_common_opt_conn_bw_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_conn_bw_count_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_conn_bw_count_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_conn_bw_counts_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_conn_bw_counts_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_common_enable_params_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_common_enable_params_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_common_opt_pa_lna_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_common_opt_pa_lna_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_pa_lna_cfg_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_pa_lna_cfg_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_user_mem_block_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_user_mem_block_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_version_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_version_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_evt_data_length_changed_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_evt_data_length_changed_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t ble_common_opt_conn_evt_ext_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_common_opt_conn_evt_ext_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+#if NRF_SD_BLE_API_VERSION >= 4
+uint32_t ble_common_cfg_vs_uuid_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_common_cfg_vs_uuid_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+#endif
+
+#if defined(NRF_SD_BLE_API_VERSION) && NRF_SD_BLE_API_VERSION > 4
+uint32_t ble_data_t_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t ble_data_t_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+#endif
+#ifdef __cplusplus
+}
+#endif
+
+#endif // BLE_STRUCT_SERIALIZATION_H__
diff --git a/thirdparty/nRF5_SDK_15.0.0_a53641a/components/serialization/common/struct_ser/ble/nrf_soc_struct_serialization.c b/thirdparty/nRF5_SDK_15.0.0_a53641a/components/serialization/common/struct_ser/ble/nrf_soc_struct_serialization.c
new file mode 100644
index 0000000..47a0aac
--- /dev/null
+++ b/thirdparty/nRF5_SDK_15.0.0_a53641a/components/serialization/common/struct_ser/ble/nrf_soc_struct_serialization.c
@@ -0,0 +1,90 @@
+/**
+ * Copyright (c) 2014 - 2018, Nordic Semiconductor ASA
+ *
+ * All rights reserved.
+ *
+ * Redistribution and use in source and binary forms, with or without modification,
+ * are permitted provided that the following conditions are met:
+ *
+ * 1. Redistributions of source code must retain the above copyright notice, this
+ * list of conditions and the following disclaimer.
+ *
+ * 2. Redistributions in binary form, except as embedded into a Nordic
+ * Semiconductor ASA integrated circuit in a product or a software update for
+ * such product, must reproduce the above copyright notice, this list of
+ * conditions and the following disclaimer in the documentation and/or other
+ * materials provided with the distribution.
+ *
+ * 3. Neither the name of Nordic Semiconductor ASA nor the names of its
+ * contributors may be used to endorse or promote products derived from this
+ * software without specific prior written permission.
+ *
+ * 4. This software, with or without modification, must only be used with a
+ * Nordic Semiconductor ASA integrated circuit.
+ *
+ * 5. Any software provided in binary form under this license must not be reverse
+ * engineered, decompiled, modified and/or disassembled.
+ *
+ * THIS SOFTWARE IS PROVIDED BY NORDIC SEMICONDUCTOR ASA "AS IS" AND ANY EXPRESS
+ * OR IMPLIED WARRANTIES, INCLUDING, BUT NOT LIMITED TO, THE IMPLIED WARRANTIES
+ * OF MERCHANTABILITY, NONINFRINGEMENT, AND FITNESS FOR A PARTICULAR PURPOSE ARE
+ * DISCLAIMED. IN NO EVENT SHALL NORDIC SEMICONDUCTOR ASA OR CONTRIBUTORS BE
+ * LIABLE FOR ANY DIRECT, INDIRECT, INCIDENTAL, SPECIAL, EXEMPLARY, OR
+ * CONSEQUENTIAL DAMAGES (INCLUDING, BUT NOT LIMITED TO, PROCUREMENT OF SUBSTITUTE
+ * GOODS OR SERVICES; LOSS OF USE, DATA, OR PROFITS; OR BUSINESS INTERRUPTION)
+ * HOWEVER CAUSED AND ON ANY THEORY OF LIABILITY, WHETHER IN CONTRACT, STRICT
+ * LIABILITY, OR TORT (INCLUDING NEGLIGENCE OR OTHERWISE) ARISING IN ANY WAY OUT
+ * OF THE USE OF THIS SOFTWARE, EVEN IF ADVISED OF THE POSSIBILITY OF SUCH DAMAGE.
+ *
+ */
+#include "nrf_soc_struct_serialization.h"
+#include "ble_serialization.h"
+#include "cond_field_serialization.h"
+#include "app_util.h"
+#include "string.h"
+
+uint32_t nrf_ecb_hal_data_t_in_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(nrf_ecb_hal_data_t);
+
+ SER_PUSH_uint8array(p_struct->key, SOC_ECB_KEY_LENGTH);
+ SER_PUSH_uint8array(p_struct->cleartext, SOC_ECB_CLEARTEXT_LENGTH);
+
+ SER_STRUCT_DEC_END;
+}
+
+uint32_t nrf_ecb_hal_data_t_in_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(nrf_ecb_hal_data_t);
+
+ SER_PULL_uint8array(p_struct->key, SOC_ECB_KEY_LENGTH);
+ SER_PULL_uint8array(p_struct->cleartext, SOC_ECB_CLEARTEXT_LENGTH);
+
+ SER_STRUCT_DEC_END;
+}
+
+uint32_t nrf_ecb_hal_data_t_out_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index)
+{
+ SER_STRUCT_ENC_BEGIN(nrf_ecb_hal_data_t);
+ SER_PUSH_uint8array(p_struct->ciphertext, SOC_ECB_CIPHERTEXT_LENGTH);
+ SER_STRUCT_DEC_END;
+}
+
+uint32_t nrf_ecb_hal_data_t_out_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct)
+{
+ SER_STRUCT_DEC_BEGIN(nrf_ecb_hal_data_t);
+ SER_PULL_uint8array(p_struct->ciphertext, SOC_ECB_CIPHERTEXT_LENGTH);
+ SER_STRUCT_DEC_END;
+}
diff --git a/thirdparty/nRF5_SDK_15.0.0_a53641a/components/serialization/common/struct_ser/ble/nrf_soc_struct_serialization.h b/thirdparty/nRF5_SDK_15.0.0_a53641a/components/serialization/common/struct_ser/ble/nrf_soc_struct_serialization.h
new file mode 100644
index 0000000..b6923e9
--- /dev/null
+++ b/thirdparty/nRF5_SDK_15.0.0_a53641a/components/serialization/common/struct_ser/ble/nrf_soc_struct_serialization.h
@@ -0,0 +1,73 @@
+/**
+ * Copyright (c) 2014 - 2018, Nordic Semiconductor ASA
+ *
+ * All rights reserved.
+ *
+ * Redistribution and use in source and binary forms, with or without modification,
+ * are permitted provided that the following conditions are met:
+ *
+ * 1. Redistributions of source code must retain the above copyright notice, this
+ * list of conditions and the following disclaimer.
+ *
+ * 2. Redistributions in binary form, except as embedded into a Nordic
+ * Semiconductor ASA integrated circuit in a product or a software update for
+ * such product, must reproduce the above copyright notice, this list of
+ * conditions and the following disclaimer in the documentation and/or other
+ * materials provided with the distribution.
+ *
+ * 3. Neither the name of Nordic Semiconductor ASA nor the names of its
+ * contributors may be used to endorse or promote products derived from this
+ * software without specific prior written permission.
+ *
+ * 4. This software, with or without modification, must only be used with a
+ * Nordic Semiconductor ASA integrated circuit.
+ *
+ * 5. Any software provided in binary form under this license must not be reverse
+ * engineered, decompiled, modified and/or disassembled.
+ *
+ * THIS SOFTWARE IS PROVIDED BY NORDIC SEMICONDUCTOR ASA "AS IS" AND ANY EXPRESS
+ * OR IMPLIED WARRANTIES, INCLUDING, BUT NOT LIMITED TO, THE IMPLIED WARRANTIES
+ * OF MERCHANTABILITY, NONINFRINGEMENT, AND FITNESS FOR A PARTICULAR PURPOSE ARE
+ * DISCLAIMED. IN NO EVENT SHALL NORDIC SEMICONDUCTOR ASA OR CONTRIBUTORS BE
+ * LIABLE FOR ANY DIRECT, INDIRECT, INCIDENTAL, SPECIAL, EXEMPLARY, OR
+ * CONSEQUENTIAL DAMAGES (INCLUDING, BUT NOT LIMITED TO, PROCUREMENT OF SUBSTITUTE
+ * GOODS OR SERVICES; LOSS OF USE, DATA, OR PROFITS; OR BUSINESS INTERRUPTION)
+ * HOWEVER CAUSED AND ON ANY THEORY OF LIABILITY, WHETHER IN CONTRACT, STRICT
+ * LIABILITY, OR TORT (INCLUDING NEGLIGENCE OR OTHERWISE) ARISING IN ANY WAY OUT
+ * OF THE USE OF THIS SOFTWARE, EVEN IF ADVISED OF THE POSSIBILITY OF SUCH DAMAGE.
+ *
+ */
+#ifndef NRF_SOC_STRUCT_SERIALIZATION_H__
+#define NRF_SOC_STRUCT_SERIALIZATION_H__
+
+#include "nrf_soc.h"
+
+#ifdef __cplusplus
+extern "C" {
+#endif
+
+uint32_t nrf_ecb_hal_data_t_in_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t nrf_ecb_hal_data_t_in_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+uint32_t nrf_ecb_hal_data_t_out_enc(void const * const p_void_struct,
+ uint8_t * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index);
+
+uint32_t nrf_ecb_hal_data_t_out_dec(uint8_t const * const p_buf,
+ uint32_t buf_len,
+ uint32_t * const p_index,
+ void * const p_void_struct);
+
+#ifdef __cplusplus
+}
+#endif
+
+#endif // NRF_SOC_STRUCT_SERIALIZATION_H__