2018-01-05 02:19:51 -04:00
|
|
|
/*
|
|
|
|
* This file is free software: you can redistribute it and/or modify it
|
|
|
|
* under the terms of the GNU General Public License as published by the
|
|
|
|
* Free Software Foundation, either version 3 of the License, or
|
|
|
|
* (at your option) any later version.
|
|
|
|
*
|
|
|
|
* This file is distributed in the hope that it will be useful, but
|
|
|
|
* WITHOUT ANY WARRANTY; without even the implied warranty of
|
|
|
|
* MERCHANTABILITY or FITNESS FOR A PARTICULAR PURPOSE.
|
|
|
|
* See the GNU General Public License for more details.
|
|
|
|
*
|
|
|
|
* You should have received a copy of the GNU General Public License along
|
|
|
|
* with this program. If not, see <http://www.gnu.org/licenses/>.
|
2019-10-20 10:31:12 -03:00
|
|
|
*
|
2018-01-05 02:19:51 -04:00
|
|
|
* Code by Andrew Tridgell and Siddharth Bharat Purohit
|
|
|
|
*/
|
|
|
|
#include <AP_HAL/AP_HAL.h>
|
|
|
|
#if CONFIG_HAL_BOARD == HAL_BOARD_CHIBIOS
|
|
|
|
|
|
|
|
#include <assert.h>
|
|
|
|
|
2022-02-20 23:44:56 -04:00
|
|
|
#include <hal.h>
|
2018-01-05 02:19:51 -04:00
|
|
|
#include "HAL_ChibiOS_Class.h"
|
|
|
|
#include <AP_HAL_Empty/AP_HAL_Empty_Private.h>
|
|
|
|
#include <AP_HAL_ChibiOS/AP_HAL_ChibiOS_Private.h>
|
|
|
|
#include "shared_dma.h"
|
2018-04-28 21:09:09 -03:00
|
|
|
#include "sdcard.h"
|
2018-03-06 18:41:03 -04:00
|
|
|
#include "hwdef/common/usbcfg.h"
|
2018-07-11 02:11:36 -03:00
|
|
|
#include "hwdef/common/stm32_util.h"
|
2019-04-11 05:01:49 -03:00
|
|
|
#include "hwdef/common/watchdog.h"
|
2019-04-11 05:25:51 -03:00
|
|
|
#include <AP_BoardConfig/AP_BoardConfig.h>
|
2019-04-19 23:58:48 -03:00
|
|
|
#include <AP_InternalError/AP_InternalError.h>
|
2019-05-09 16:58:36 -03:00
|
|
|
#ifndef HAL_BOOTLOADER_BUILD
|
2019-05-09 08:15:58 -03:00
|
|
|
#include <AP_Logger/AP_Logger.h>
|
2019-05-09 16:58:36 -03:00
|
|
|
#endif
|
2020-11-09 00:56:58 -04:00
|
|
|
#include <AP_Vehicle/AP_Vehicle_Type.h>
|
2021-11-01 04:16:41 -03:00
|
|
|
#include <AP_HAL/SIMState.h>
|
2018-01-05 02:19:51 -04:00
|
|
|
|
2018-01-11 21:41:45 -04:00
|
|
|
#include <hwdef.h>
|
|
|
|
|
2023-05-03 21:30:51 -03:00
|
|
|
#ifndef DEFAULT_SERIAL0_BAUD
|
|
|
|
#define SERIAL0_BAUD 115200
|
|
|
|
#else
|
|
|
|
#define SERIAL0_BAUD DEFAULT_SERIAL0_BAUD
|
2023-01-19 20:12:55 -04:00
|
|
|
#endif
|
|
|
|
|
2018-06-25 00:38:58 -03:00
|
|
|
#ifndef HAL_NO_UARTDRIVER
|
2023-12-11 00:55:15 -04:00
|
|
|
static HAL_SERIAL0_DRIVER;
|
|
|
|
static HAL_SERIAL1_DRIVER;
|
|
|
|
static HAL_SERIAL2_DRIVER;
|
|
|
|
static HAL_SERIAL3_DRIVER;
|
|
|
|
static HAL_SERIAL4_DRIVER;
|
|
|
|
static HAL_SERIAL5_DRIVER;
|
|
|
|
static HAL_SERIAL6_DRIVER;
|
|
|
|
static HAL_SERIAL7_DRIVER;
|
|
|
|
static HAL_SERIAL8_DRIVER;
|
|
|
|
static HAL_SERIAL9_DRIVER;
|
2018-06-25 00:38:58 -03:00
|
|
|
#else
|
2023-12-11 00:55:15 -04:00
|
|
|
static Empty::UARTDriver serial0Driver;
|
|
|
|
static Empty::UARTDriver serial1Driver;
|
|
|
|
static Empty::UARTDriver serial2Driver;
|
|
|
|
static Empty::UARTDriver serial3Driver;
|
|
|
|
static Empty::UARTDriver serial4Driver;
|
|
|
|
static Empty::UARTDriver serial5Driver;
|
|
|
|
static Empty::UARTDriver serial6Driver;
|
|
|
|
static Empty::UARTDriver serial7Driver;
|
|
|
|
static Empty::UARTDriver serial8Driver;
|
|
|
|
static Empty::UARTDriver serial9Driver;
|
2018-06-25 00:38:58 -03:00
|
|
|
#endif
|
2018-03-01 20:46:30 -04:00
|
|
|
|
2019-05-26 22:45:30 -03:00
|
|
|
#if HAL_USE_I2C == TRUE && defined(HAL_I2C_DEVICE_LIST)
|
2018-01-05 02:19:51 -04:00
|
|
|
static ChibiOS::I2CDeviceManager i2cDeviceManager;
|
2018-03-01 20:46:30 -04:00
|
|
|
#else
|
|
|
|
static Empty::I2CDeviceManager i2cDeviceManager;
|
|
|
|
#endif
|
|
|
|
|
|
|
|
#if HAL_USE_SPI == TRUE
|
2018-01-05 02:19:51 -04:00
|
|
|
static ChibiOS::SPIDeviceManager spiDeviceManager;
|
2018-03-01 20:46:30 -04:00
|
|
|
#else
|
|
|
|
static Empty::SPIDeviceManager spiDeviceManager;
|
|
|
|
#endif
|
|
|
|
|
2018-10-28 20:24:01 -03:00
|
|
|
#if HAL_USE_ADC == TRUE && !defined(HAL_DISABLE_ADC_DRIVER)
|
2018-01-13 00:02:05 -04:00
|
|
|
static ChibiOS::AnalogIn analogIn;
|
2018-03-06 18:41:03 -04:00
|
|
|
#else
|
|
|
|
static Empty::AnalogIn analogIn;
|
|
|
|
#endif
|
|
|
|
|
2018-01-26 22:35:53 -04:00
|
|
|
#ifdef HAL_USE_EMPTY_STORAGE
|
|
|
|
static Empty::Storage storageDriver;
|
|
|
|
#else
|
2018-01-13 00:02:05 -04:00
|
|
|
static ChibiOS::Storage storageDriver;
|
2018-01-26 22:35:53 -04:00
|
|
|
#endif
|
2018-01-13 00:02:05 -04:00
|
|
|
static ChibiOS::GPIO gpioDriver;
|
|
|
|
static ChibiOS::RCInput rcinDriver;
|
2018-03-01 20:46:30 -04:00
|
|
|
|
|
|
|
#if HAL_USE_PWM == TRUE
|
2018-01-13 00:02:05 -04:00
|
|
|
static ChibiOS::RCOutput rcoutDriver;
|
2018-03-01 20:46:30 -04:00
|
|
|
#else
|
|
|
|
static Empty::RCOutput rcoutDriver;
|
|
|
|
#endif
|
|
|
|
|
2018-01-13 00:02:05 -04:00
|
|
|
static ChibiOS::Scheduler schedulerInstance;
|
|
|
|
static ChibiOS::Util utilInstance;
|
2018-01-05 02:19:51 -04:00
|
|
|
static Empty::OpticalFlow opticalFlowDriver;
|
2019-04-08 01:22:26 -03:00
|
|
|
|
2021-11-01 04:16:41 -03:00
|
|
|
#if AP_SIM_ENABLED
|
|
|
|
static AP_HAL::SIMState xsimstate;
|
|
|
|
#endif
|
|
|
|
|
2019-08-09 13:04:28 -03:00
|
|
|
#if HAL_WITH_DSP
|
|
|
|
static ChibiOS::DSP dspDriver;
|
|
|
|
#endif
|
|
|
|
|
2019-04-08 01:22:26 -03:00
|
|
|
#ifndef HAL_NO_FLASH_SUPPORT
|
2019-03-25 21:13:51 -03:00
|
|
|
static ChibiOS::Flash flashDriver;
|
2019-04-08 01:22:26 -03:00
|
|
|
#else
|
|
|
|
static Empty::Flash flashDriver;
|
|
|
|
#endif
|
2018-04-28 21:09:09 -03:00
|
|
|
|
2020-05-31 09:17:00 -03:00
|
|
|
#if HAL_NUM_CAN_IFACES > 0
|
|
|
|
static ChibiOS::CANIface* canDrivers[HAL_NUM_CAN_IFACES];
|
|
|
|
#endif
|
2018-01-05 02:19:51 -04:00
|
|
|
|
2022-08-17 10:15:32 -03:00
|
|
|
#if HAL_USE_WSPI == TRUE && defined(HAL_WSPI_DEVICE_LIST)
|
|
|
|
static ChibiOS::WSPIDeviceManager wspiDeviceManager;
|
2021-05-29 16:47:40 -03:00
|
|
|
#endif
|
|
|
|
|
2018-01-05 02:19:51 -04:00
|
|
|
#if HAL_WITH_IO_MCU
|
2018-01-11 21:41:45 -04:00
|
|
|
HAL_UART_IO_DRIVER;
|
2018-01-05 02:19:51 -04:00
|
|
|
#include <AP_IOMCU/AP_IOMCU.h>
|
|
|
|
AP_IOMCU iomcu(uart_io);
|
|
|
|
#endif
|
|
|
|
|
|
|
|
HAL_ChibiOS::HAL_ChibiOS() :
|
|
|
|
AP_HAL::HAL(
|
2023-12-11 00:55:15 -04:00
|
|
|
&serial0Driver,
|
|
|
|
&serial1Driver,
|
|
|
|
&serial2Driver,
|
|
|
|
&serial3Driver,
|
|
|
|
&serial4Driver,
|
|
|
|
&serial5Driver,
|
|
|
|
&serial6Driver,
|
|
|
|
&serial7Driver,
|
|
|
|
&serial8Driver,
|
|
|
|
&serial9Driver,
|
2018-01-05 02:19:51 -04:00
|
|
|
&i2cDeviceManager,
|
|
|
|
&spiDeviceManager,
|
2022-08-17 10:15:32 -03:00
|
|
|
#if HAL_USE_WSPI == TRUE && defined(HAL_WSPI_DEVICE_LIST)
|
|
|
|
&wspiDeviceManager,
|
2021-06-13 14:18:56 -03:00
|
|
|
#else
|
|
|
|
nullptr,
|
|
|
|
#endif
|
2018-01-05 02:19:51 -04:00
|
|
|
&analogIn,
|
|
|
|
&storageDriver,
|
2023-12-11 00:55:15 -04:00
|
|
|
&serial0Driver,
|
2018-01-05 02:19:51 -04:00
|
|
|
&gpioDriver,
|
|
|
|
&rcinDriver,
|
|
|
|
&rcoutDriver,
|
|
|
|
&schedulerInstance,
|
|
|
|
&utilInstance,
|
|
|
|
&opticalFlowDriver,
|
2019-03-25 21:13:51 -03:00
|
|
|
&flashDriver,
|
2021-11-01 04:16:41 -03:00
|
|
|
#if AP_SIM_ENABLED
|
|
|
|
&xsimstate,
|
|
|
|
#endif
|
2023-09-30 18:17:34 -03:00
|
|
|
#if HAL_WITH_DSP
|
2019-08-09 13:04:28 -03:00
|
|
|
&dspDriver,
|
2023-09-30 18:17:34 -03:00
|
|
|
#endif
|
2020-05-31 09:17:00 -03:00
|
|
|
#if HAL_NUM_CAN_IFACES
|
|
|
|
(AP_HAL::CANIface**)canDrivers
|
|
|
|
#else
|
2018-01-05 02:19:51 -04:00
|
|
|
nullptr
|
2020-05-31 09:17:00 -03:00
|
|
|
#endif
|
2018-01-05 02:19:51 -04:00
|
|
|
)
|
|
|
|
{}
|
|
|
|
|
|
|
|
static bool thread_running = false; /**< Daemon status flag */
|
|
|
|
static thread_t* daemon_task; /**< Handle of daemon task / thread */
|
|
|
|
|
|
|
|
extern const AP_HAL::HAL& hal;
|
|
|
|
|
|
|
|
|
|
|
|
/*
|
|
|
|
set the priority of the main APM task
|
|
|
|
*/
|
|
|
|
void hal_chibios_set_priority(uint8_t priority)
|
|
|
|
{
|
|
|
|
chSysLock();
|
2018-03-06 18:41:03 -04:00
|
|
|
#if CH_CFG_USE_MUTEXES == TRUE
|
2021-02-18 17:52:58 -04:00
|
|
|
if ((daemon_task->hdr.pqueue.prio == daemon_task->realprio) || (priority > daemon_task->hdr.pqueue.prio)) {
|
|
|
|
daemon_task->hdr.pqueue.prio = priority;
|
2018-01-05 02:19:51 -04:00
|
|
|
}
|
|
|
|
daemon_task->realprio = priority;
|
2018-03-06 18:41:03 -04:00
|
|
|
#endif
|
2018-01-05 02:19:51 -04:00
|
|
|
chSchRescheduleS();
|
|
|
|
chSysUnlock();
|
|
|
|
}
|
|
|
|
|
|
|
|
thread_t* get_main_thread()
|
|
|
|
{
|
|
|
|
return daemon_task;
|
|
|
|
}
|
|
|
|
|
|
|
|
static AP_HAL::HAL::Callbacks* g_callbacks;
|
2018-08-29 10:11:48 -03:00
|
|
|
|
|
|
|
static void main_loop()
|
2018-01-05 02:19:51 -04:00
|
|
|
{
|
|
|
|
daemon_task = chThdGetSelfX();
|
|
|
|
|
2018-08-29 10:11:48 -03:00
|
|
|
/*
|
|
|
|
switch to high priority for main loop
|
|
|
|
*/
|
|
|
|
chThdSetPriority(APM_MAIN_PRIORITY);
|
|
|
|
|
2018-02-06 19:48:36 -04:00
|
|
|
#ifdef HAL_I2C_CLEAR_BUS
|
|
|
|
// Clear all I2C Buses. This can be needed on some boards which
|
|
|
|
// can get a stuck I2C peripheral on boot
|
2018-02-05 15:40:05 -04:00
|
|
|
ChibiOS::I2CBus::clear_all();
|
2018-02-06 19:48:36 -04:00
|
|
|
#endif
|
2018-02-05 15:40:05 -04:00
|
|
|
|
2022-07-14 04:47:42 -03:00
|
|
|
#if AP_HAL_SHARED_DMA_ENABLED
|
2018-01-13 00:02:05 -04:00
|
|
|
ChibiOS::Shared_DMA::init();
|
2021-02-23 00:07:53 -04:00
|
|
|
#endif
|
|
|
|
|
2018-07-12 07:47:48 -03:00
|
|
|
peripheral_power_enable();
|
2019-10-20 10:31:12 -03:00
|
|
|
|
2023-05-03 21:30:51 -03:00
|
|
|
hal.serial(0)->begin(SERIAL0_BAUD);
|
2018-03-07 17:42:35 -04:00
|
|
|
|
2024-01-08 17:05:43 -04:00
|
|
|
#if (HAL_USE_SPI == TRUE) && defined(HAL_SPI_CHECK_CLOCK_FREQ)
|
2018-03-07 17:42:35 -04:00
|
|
|
// optional test of SPI clock frequencies
|
|
|
|
ChibiOS::SPIDevice::test_clock_freq();
|
2019-10-20 10:31:12 -03:00
|
|
|
#endif
|
2018-04-28 21:09:09 -03:00
|
|
|
|
2018-01-05 02:19:51 -04:00
|
|
|
hal.analogin->init();
|
|
|
|
hal.scheduler->init();
|
|
|
|
|
|
|
|
/*
|
|
|
|
run setup() at low priority to ensure CLI doesn't hang the
|
|
|
|
system, and to allow initial sensor read loops to run
|
|
|
|
*/
|
|
|
|
hal_chibios_set_priority(APM_STARTUP_PRIORITY);
|
|
|
|
|
2019-05-09 04:49:32 -03:00
|
|
|
if (stm32_was_watchdog_reset()) {
|
|
|
|
// load saved watchdog data
|
|
|
|
stm32_watchdog_load((uint32_t *)&utilInstance.persistent_data, (sizeof(utilInstance.persistent_data)+3)/4);
|
2020-03-25 08:07:49 -03:00
|
|
|
utilInstance.last_persistent_data = utilInstance.persistent_data;
|
2019-05-09 04:49:32 -03:00
|
|
|
}
|
|
|
|
|
2019-05-09 08:15:58 -03:00
|
|
|
schedulerInstance.hal_initialized();
|
2018-01-05 02:19:51 -04:00
|
|
|
|
2019-05-09 08:15:58 -03:00
|
|
|
g_callbacks->setup();
|
2018-01-05 02:19:51 -04:00
|
|
|
|
2021-01-16 01:01:04 -04:00
|
|
|
#if HAL_ENABLE_SAVE_PERSISTENT_PARAMS
|
|
|
|
utilInstance.apply_persistent_params();
|
|
|
|
#endif
|
|
|
|
|
2022-08-15 00:54:08 -03:00
|
|
|
#if HAL_FLASH_PROTECTION
|
2022-02-18 17:31:53 -04:00
|
|
|
if (AP_BoardConfig::unlock_flash()) {
|
|
|
|
stm32_flash_unprotect_flash();
|
|
|
|
} else {
|
|
|
|
stm32_flash_protect_flash(false, AP_BoardConfig::protect_flash());
|
|
|
|
stm32_flash_protect_flash(true, AP_BoardConfig::protect_bootloader());
|
|
|
|
}
|
|
|
|
#endif
|
|
|
|
|
2021-10-28 03:43:26 -03:00
|
|
|
#if !defined(DISABLE_WATCHDOG)
|
2019-05-09 16:58:36 -03:00
|
|
|
#ifdef IOMCU_FW
|
|
|
|
stm32_watchdog_init();
|
2023-05-22 03:31:10 -03:00
|
|
|
#elif !defined(HAL_BOOTLOADER_BUILD)
|
2023-11-15 00:41:27 -04:00
|
|
|
#if !defined(HAL_EARLY_WATCHDOG_INIT)
|
2019-04-11 05:01:49 -03:00
|
|
|
// setup watchdog to reset if main loop stops
|
2019-04-11 08:12:03 -03:00
|
|
|
if (AP_BoardConfig::watchdog_enabled()) {
|
2019-04-11 05:25:51 -03:00
|
|
|
stm32_watchdog_init();
|
|
|
|
}
|
2023-11-15 00:41:27 -04:00
|
|
|
#endif
|
2019-04-11 05:01:49 -03:00
|
|
|
|
2019-04-19 23:58:48 -03:00
|
|
|
if (hal.util->was_watchdog_reset()) {
|
2020-04-29 21:40:45 -03:00
|
|
|
INTERNAL_ERROR(AP_InternalError::error_t::watchdog_reset);
|
2019-04-19 23:58:48 -03:00
|
|
|
}
|
2019-07-31 23:47:21 -03:00
|
|
|
#endif // IOMCU_FW
|
2021-10-28 03:43:26 -03:00
|
|
|
#endif // DISABLE_WATCHDOG
|
2019-05-09 16:58:36 -03:00
|
|
|
|
2019-05-09 08:15:58 -03:00
|
|
|
schedulerInstance.watchdog_pat();
|
2019-04-19 23:58:48 -03:00
|
|
|
|
2020-12-23 07:26:59 -04:00
|
|
|
hal.scheduler->set_system_initialized();
|
2019-05-09 08:15:58 -03:00
|
|
|
|
|
|
|
thread_running = true;
|
|
|
|
chRegSetThreadName(SKETCHNAME);
|
2019-10-20 10:31:12 -03:00
|
|
|
|
2019-05-09 08:15:58 -03:00
|
|
|
/*
|
|
|
|
switch to high priority for main loop
|
|
|
|
*/
|
|
|
|
chThdSetPriority(APM_MAIN_PRIORITY);
|
2019-05-09 04:49:32 -03:00
|
|
|
|
2018-01-05 02:19:51 -04:00
|
|
|
while (true) {
|
|
|
|
g_callbacks->loop();
|
|
|
|
|
|
|
|
/*
|
2019-02-17 21:40:50 -04:00
|
|
|
give up 50 microseconds of time if the INS loop hasn't
|
2018-02-09 22:46:55 -04:00
|
|
|
called delay_microseconds_boost(), to ensure low priority
|
|
|
|
drivers get a chance to run. Calling
|
|
|
|
delay_microseconds_boost() means we have already given up
|
|
|
|
time from the main loop, so we don't need to do it again
|
|
|
|
here
|
2018-01-05 02:19:51 -04:00
|
|
|
*/
|
2020-11-08 23:44:55 -04:00
|
|
|
#if !defined(HAL_DISABLE_LOOP_DELAY) && !APM_BUILD_TYPE(APM_BUILD_Replay)
|
2018-02-09 22:46:55 -04:00
|
|
|
if (!schedulerInstance.check_called_boost()) {
|
2019-02-17 21:40:50 -04:00
|
|
|
hal.scheduler->delay_microseconds(50);
|
2018-02-09 22:46:55 -04:00
|
|
|
}
|
2018-10-29 19:20:33 -03:00
|
|
|
#endif
|
2019-05-09 08:15:58 -03:00
|
|
|
schedulerInstance.watchdog_pat();
|
2018-01-05 02:19:51 -04:00
|
|
|
}
|
|
|
|
thread_running = false;
|
|
|
|
}
|
|
|
|
|
|
|
|
void HAL_ChibiOS::run(int argc, char * const argv[], Callbacks* callbacks) const
|
|
|
|
{
|
2023-11-15 00:41:27 -04:00
|
|
|
#if defined(HAL_EARLY_WATCHDOG_INIT) && !defined(DISABLE_WATCHDOG)
|
|
|
|
stm32_watchdog_init();
|
|
|
|
stm32_watchdog_pat();
|
|
|
|
#endif
|
2018-01-05 02:19:51 -04:00
|
|
|
/*
|
|
|
|
* System initializations.
|
|
|
|
* - ChibiOS HAL initialization, this also initializes the configured device drivers
|
|
|
|
* and performs the board-specific initializations.
|
|
|
|
* - Kernel initialization, the main() function becomes a thread and the
|
|
|
|
* RTOS is active.
|
|
|
|
*/
|
2018-03-01 20:46:30 -04:00
|
|
|
|
2020-02-11 18:50:18 -04:00
|
|
|
#if HAL_USE_SERIAL_USB == TRUE
|
|
|
|
usb_initialise();
|
2018-03-06 18:41:03 -04:00
|
|
|
#endif
|
2019-10-20 10:31:12 -03:00
|
|
|
|
2018-03-01 20:46:30 -04:00
|
|
|
#ifdef HAL_STDOUT_SERIAL
|
2021-05-04 06:09:29 -03:00
|
|
|
//STDOUT Initialisation
|
2018-01-05 02:19:51 -04:00
|
|
|
SerialConfig stdoutcfg =
|
|
|
|
{
|
|
|
|
HAL_STDOUT_BAUDRATE,
|
|
|
|
0,
|
|
|
|
USART_CR2_STOP1_BITS,
|
|
|
|
0
|
|
|
|
};
|
|
|
|
sdStart((SerialDriver*)&HAL_STDOUT_SERIAL, &stdoutcfg);
|
2018-03-01 20:46:30 -04:00
|
|
|
#endif
|
2018-01-05 02:19:51 -04:00
|
|
|
|
|
|
|
g_callbacks = callbacks;
|
|
|
|
|
2018-08-29 10:11:48 -03:00
|
|
|
//Takeover main
|
|
|
|
main_loop();
|
2018-01-05 02:19:51 -04:00
|
|
|
}
|
|
|
|
|
2023-11-23 21:55:45 -04:00
|
|
|
static HAL_ChibiOS hal_chibios;
|
|
|
|
|
2018-01-05 02:19:51 -04:00
|
|
|
const AP_HAL::HAL& AP_HAL::get_HAL() {
|
2023-11-23 21:55:45 -04:00
|
|
|
return hal_chibios;
|
|
|
|
}
|
|
|
|
|
|
|
|
AP_HAL::HAL& AP_HAL::get_HAL_mutable() {
|
2018-01-05 02:19:51 -04:00
|
|
|
return hal_chibios;
|
|
|
|
}
|
|
|
|
|
|
|
|
#endif
|