Back to Release page

Release Notes for STM32F3xx HAL Drivers

Copyright 2016 STMicroelectronics

 

Update History

V1.5.0 / 23-June-2017

Main changes

  • Maintenance release to fix known defects and enhancements implementation

Generic drivers changes

  • MISRA C 2004 rule 11.4 (A cast should not be performed between a pointer to object type and a different pointer to object type).
  • MISRA C 2004 rule 12.4 (The right-hand operand of a logical  or  I  I  operator shall not
    contain side effects).
  • MISRA C 2004 rule 17.4 (Array indexing shall be the only allowed form of pointer arithmetic).
  • Remove uselesss cast (uint32_t ) cast in case of 'U' suffix.
  • Fix Code Sonar warnings (useless assignment, cast alters value, empty while statement ...).
  • Minor improvement of Doxygen Tags for CHM UM generation.
  • Replace POSITION_VAL(xxx) macro by corresponding CMSIS_Pos definitions.

HAL Drivers changes

  • The following changes done on the HAL drivers require an update on the application code based on HAL V1.3.0
    • HAL NAND driver: Overall driver rework with compatibility break versus previous HAL version (see below).

  • HAL
    • Correct RTC_PREDIV values (for LSI clock) in hal_timebase_rtc_alam_template.c and hal_timebase_rtc_wakeup_template.c
    • Add definition of USE_SPI_CRC in hal_conf_template.h
    • Modify HAL_Delay() function to garantee minimum delay.
    • New API : HAL_GetUIDwx() read the unique device identifier word x.
  • HAL ADC
    • Remove unused litteral ADC_EOC_SINGLE_SEQ_CONV.
    • Correct name of one ADC1 external trigger of regular group : ADC_EXTERNALTRIGCONV_T4_CC4.
  • HAL CAN
    • Add transmission abort when timeout is reached in HAL_CAN_Transmit().
    • Add managment of overrun error. 
    • Store missing FIFO number in received message.
    • Extend SET_BIT, CLEAR_BIT macro usage.
    • Allow possibility to receive messages from the 2 RX FIFOs in parallel via interrupt.
    • Fix message lost issue with specific sequence of transmit requests.
  • HAL COMP
    • COMP_WINDOWMODE litterals clean-up according to family diversity.
  • HAL NAND
    • Overall driver rework in order to support NAND flash memories with higher capacities. 
    • Add support of 16 bits adressing mode
    • API changes :
      • Add HAL_NAND_ConfigDevice() function
      • Split HAL_NAND_Read_Page(), HAL_NAND_Write_Page(), HAL_NAND_Read_SpareArea(), HAL_NAND_Write_SpareArea() in _8b and  _ 16b functions to select the proper adressing mode.
  • HAL HRTIM
    • Modify __HAL_HRTIM_SETCLOCKPRESCALER macro to clear CKPSC and CKPSCx bits before setting new prescaler value.
    • Correct HRTIM_EVENTFASTMODE_DISABLE and HRTIM_EVENTFASTMODE_ENABLE defines.
  • HAL I2C
    • Editorial modification : astyle clean-up
  • HAL SMBUS
    • New API : Digital/Analog filter configuration with HAL_SMBUS_ConfigAnalogFilter() and HAL_SMBUS_ConfigDigitalFilter().
  • HAL PCD 
    • Fix and Improve PCD_ReadPMA() API to prevent corrupting user buffer.
    • Minor changes in HAL_PCD_CLEAR_FLAG, PCD_CLEAR_TX/RX_EP_CTR macros.
    • Fix USB device remote wakeup issue.
    • USB PCD interrupt handler: remove useless usb device interrupts enable, already set during the pcd init.
    • Remove lock/unlock from USB receive and transmit endpoints.
  • HAL RTC
    • Correct RTC Time register initialization.
  • HAL SPI
    • Empty RXFIFO in case of end of MASTER transmission 2 lines.
  • HAL I2S
    • Fix full duplex I2S with circular DMA issues :
      • Don't stop DMA at end of transfert
      • Solve synchroniszation issues between RX and TX.
  • HAL TIM
    • Fix typo in __HAL_TIM_SET_PRESCALER macro.
    • Improvment of TIM DMA burst mode. Add 2 new API :
      • HAL_TIM_DMABurst_MultiWriteStart()
      • HAL_TIM_DMABurst_MultiReadStart()
    • Add BRK2 (Break input 2 event) interrupt handler.
    • Update IRQ handler to use correct defines (TIM_FLAG_xxxx instead of TIM_IT_xxxx) to clear flag.

LL Drivers changes

  • LL ADC
    • Set TEMPSENSOR_CAL1_TEMP value to 30°C as specified in datasheet.
  • LL DMA
    • Replace SET_BIT macro by WRITE_REG in LL_DMA_ClearFlag_xxx() as  DMA IFCR register is read only.
    • For better performances, CPAR and CMAR regsiters are updated by WRITE_REG macro instead of MODIFY_REG.
  • LL I2C
    • OA1EN bit of OAR1 register should be set only when own address different from 0 (0 reserved for General Call address).
  • LL RTC
    • Update LL_RTC_DATE_Get() function for better performances.
  • LL SPI
    • Remove LL_SPI_SR_UDR (available only for I2S feature).
  • LL_TIM
    • Add AutomaticOutput field initialization in LL_TIM_BDTR_StructInit().
    • Fix typo in __HAL_TIM_SET_PRESCALER macro.
    • Ensure write operation of BKE and BKP bits is effective by adding fake read operation to garantee 1 APB clock cycle before function exit.
    • Exchange behavior between LL_TIM_EnableUpdateEvent() and LL_TIM_DisableUpdateEvent().
  • LL UTILS
    • Update function UTILS_EnablePLLAndSwitchSystem() to use current AHB prescaler for sysclk frequency calculation.

V1.4.0 / 16-December-2016

Main changes

  • Maintenance release to fix known defects and enhancements implementation

HAL Drivers changes

  • Enhance HAL delay and time base implementation:
    • Add new templates stm32f0xx_hal_timebase_rtc_alarm_template.c, stm32f0xx_hal_timebase_rtc_wakeup_template.c and stm32f0xx_hal_timebase_tim_template.c which can be used to override the native HAL time base functions (defined as weak) to use either RTC or Timer as time base tick source. For more details about the usage of these drivers, please refer to HAL\HAL_TimeBase examples and FreeRTOS-based applications
  • The following changes done on the HAL drivers require an update on the application code based on HAL V1.3.0
    • HAL CEC driver:  Overall driver rework with compatibility break versus previous HAL version
      • Remove HAL CEC polling Process functions: HAL_CEC_Transmit() and HAL_CEC_Receive()
      • Remove HAL CEC receive interrupt process function HAL_CEC_Receive_IT() and enable the "receive"  mode during the Init phase
      • Rename HAL_CEC_GetReceivedFrameSize() funtion to HAL_CEC_GetLastReceivedFrameSize()
      • Add new HAL APIs: HAL_CEC_SetDeviceAddress() and HAL_CEC_ChangeRxBuffer()
      • Remove the 'InitiatorAddress' field from the CEC_InitTypeDef structure and manage it as a parameter in the HAL_CEC_Transmit_IT() function
      • Add new parameter 'RxFrameSize' in HAL_CEC_RxCpltCallback() function
      • Move CEC Rx buffer pointer from CEC_HandleTypeDef structure to CEC_InitTypeDef structure
    • HAL TIM driver : add one field (AutoReloadPreload) in TIM_Base_InitTypeDef structure

  • HAL Generic
    • Update HAL Driver compliancy with:
      • MISRA C 2004 rule 10.6 ('U' suffix applied to all constants of 'unsigned' type)
  • HAL CEC
    • Overall driver rework with break of compatibility with HAL V1.3.0
      • Remove the HAL CEC polling Process: HAL_CEC_Transmit() and HAL_CEC_Receive()
      • Remove the HAL CEC receive interrupt process (HAL_CEC_Receive_IT()) and manage the "Receive" mode enable within the Init phase
      • Rename HAL_CEC_GetReceivedFrameSize() function to HAL_CEC_GetLastReceivedFrameSize() function
      • Add new HAL APIs: HAL_CEC_SetDeviceAddress() and HAL_CEC_ChangeRxBuffer()
      • Remove the 'InitiatorAddress' field from the CEC_InitTypeDef structure and manage it as a parameter in the HAL_CEC_Transmit_IT() function
      • Add new parameter 'RxFrameSize' in HAL_CEC_RxCpltCallback() function
      • Move CEC Rx buffer pointer from CEC_HandleTypeDef structure to CEC_InitTypeDef structure
    • Update driver to implement the new CEC state machine:
      • Add new "rxState" field in CEC_HandleTypeDef structure to provide the CEC state information related to Rx Operations
      • Rename "state" field in CEC_HandleTypeDef structure to "gstate": CEC state information related to global Handle management and Tx Operations
      • Update CEC process to manage the new CEC states.
      • Update __HAL_CEC_RESET_HANDLE_STATE() macro to handle the new CEC state parameters (gState, rxState)
  • HAL UART/USART/IRDA/SMARTCARD
    • IRQ Handler global optimization 
    • New abort API: HAL_PPP_Abort(), HAL_PPP_Abort_IT()
    • Add error management in case of DMA transfer through HAL_DMA_Abort_IT() and DMA XferAbortCallback()
    • Polling management update:
      • The user Timeout value must be estimated for the overall process duration
  • HAL SPI
    • Overall driver optimization to improve performance in polling/interrupt mode to reach maximum peripheral frequency
      • Polling mode:
        • Replace the use of SPI_WaitOnFlagUnitTimeout() function by "if" statement to check on RXNE/TXE flage while transferring data
      •  Interrupt mode:
        • Minimize access on SPI registers
      • All modes:
        • Add the USE_SPI_CRC switch to minimize the number of statements when CRC calculation is disabled
        • Update timeout management to check on global processes
        • Update error code management in all processes
    • Fix regression in polling mode:
      • Add preparing data to transmit in case of slave mode in HAL_SPI_TransmitReceive() and HAL_SPI_Transmit()
    • Fix regression in interrupt mode:
      • Add a wait on TXE flag in SPI_CloseTx_ISR() and in SPI_CloseTxRx_ISR()
      • Add to manage properly the overrun flag in SPI_CloseRxTx_ISR() and SPI_CloseRx_ISR()
    • Prevent data packing mode in reception for STM32F302xC, STM32F303xC, STM32F373xC, STM32F358xx, STM32F378xx
    • Add check of DMA handle definition before calling HAL_SPI_Receive_DMA, HAL_SPI_Transmit_DMA, HAL_SPI_TransmitReceive_DMA
    • Updated HAL Driver compliancy with MISRA C 2004 rules:
      • MISRA C 2004 rule 14.3 (a null statement shall only occur on a line by itself).
      • MISRA C 2004 rule 14.8 (statement forming the body of a switch, while, do … while or for statement shall be a compound statement).
  • HAL DMA
    • Global driver code optimization to reduce memory footprint 
    • Add new APIs HAL_DMA_RegisterCallback() and HAL_DMA_UnRegisterCallback to register/unregister the different callbacks identified by the enum typedef HAL_DMA_CallbackIDTypeDef
    • Add new Error Code HAL_DMA_ERROR_NOT_SUPPORTED
    • Remove DMA HAL_DMA_STATE_READY_HALF & HAL_DMA_STATE_ERROR states in HAL_DMA_StateTypeDef
  • HAL I2C
    • Disable I2C_OARx_EN bit before any configuration in OAR1 or 2 in HAL_I2C_Init()
    • Move I2C_NO_OPTION_FRAME in private section
    • Update IS_I2C_FASTMODEPLUS macro. Add I2C_FMP_NOT_SUPPORTED definition
    • Update HAL_I2C_Master_Sequential_Transmit_IT() function (wrong state check)
    • Add I2C_FIRST_AND_NEXT_FRAME option for I2C Sequential Transfer
    • On slave, reset LISTEN_TX state in case of direction change
    • Remove GCC warnings
  • HAL TIM
    • API update : add one field (AutoReloadPreload) in TIM_Base_InitTypeDef structure in order to set ARPE bit from TIMx_CR1 register
    • New API : add 2 macros (__HAL_TIM_ENABLE_OCxPRELOAD() and  __HAL_TIM_DISABLE_OCxPRELOAD()) in order to set OCxPE bit from TIMx_CCMR1, TIMx_CCMR2 and TIMx_CCMR3 registers
    • Use MODIFY_REG macro to avoid wrong initialisation in ConfigBreakDeadTime()
    • Add TIM1 ETR remap enums for STM32F334xx devices
    • HAL_TIMEx_RemapConfig() prototype changed for STM32F334x8 device
    • Remove TIM_CR2_OIS2N, TIM_CR2_OIS3, TIM_CR2_OIS3N, TIM_CR2_OIS4 managment for STM32F373xC and STM32F378xx devices
    • API update : Add __HAL_TIM_MOE_DISABLE_UNCONDITIONALLY() function to disable MOE bit without condition
  • HAL SMBUS
    • Remove useless XferSize field initialisation in  HAL_SMBUS_Slave_Transmit_IT()
    • Add support of Zone read/write feature thanks to new XferOptions parameter values SMBUS_OTHER_FRAME_NO_PEC, SMBUS_OTHER_FRAME_WITH_PEC, SMBUS_OTHER_AND_LAST_FRAME_NO_PEC and SMBUS_OTHER_AND_LAST_FRAME_WITH_PEC
  • HAL PCD 
    • Updated HAL Driver compliancy with MISRA C 2004 rules : (10.3, 105)
      • MISRA C 2004 rule 10.3 (illegal explicit conversion from underlying MISRA type "unsigned int" to "uint32_t *").
      • MISRA C 2004 rule 10.5 (bitwise operators ~ and <<).
      • MISRA C 2004 rule 12.7 (bitwise operations not performed on signed integer types).
  • HAL PWR
    • Rename PWR_CR register defines to be aligned with STM32F3xx Reference Manual : SDADCxEN ==> ENSDx
  • HAL RCC
    • Rename RCC_CFGR register defines to be aligned with STM32F3xx Reference Manual : SDADCPRE ==> SDPRE
  • HAL CORTEX
    • Update HAL_MPU_Disable() to clear the whole control register. Also remove STATIC INLINE and move function to c file
  • HAL CAN
    • Add __HAL_UNLOCK() call when all mailboxes are busy
    • Add __HAL_CAN_CANCEL_TRANSMIT() call to abort transmission when timeout is reached
  • HAL ADC
    • Add ADC_EXTERNALTRIGINJECCONV_T2_CC1 and ADC_EXTERNALTRIGINJECCONV_T2_TRGO definitions

LL Drivers changes

  • LL COMP
    • Creation of generic defines for defines specific to COMP instances
    • Modify definition of LL_COMP_OUTPUT_TIM4_IC2_COMP4, LL_COMP_OUTPUT_TIM4_IC3_COMP5 and LL_COMP_OUTPUT_TIM4_IC4_COMP6 literals
    • Rename LL_COMP_OUTPUT_TIM1_IC4_COMP2 and LL_COMP_OUTPUT_TIM1_IC4_COMP1_2 in LL_COMP_OUTPUT_TIM2_IC4_COMP2 and LL_COMP_OUTPUT_TIM2_IC4_COMP1_2
    • Correct COMP inputs definition
  • LL EXTI
    • Move LL_EXTI_LINE_18, LL_EXTI_LINE_33, LL_EXTI_LINE_34, LL_EXTI_LINE_35, LL_EXTI_LINE_36, LL_EXTI_LINE_37, LL_EXTI_LINE_38 and LL_EXTI_LINE_39 defines under compilation switch (availability depends on devices)
  • LL PWR
    • Rename PWR_CR register defines to be aligned with STM32F3xx Reference Manual : SDADCxEN ==> ENSDx
  • LL RCC
    • Rename RCC_CFGR register defines to be aligned with STM32F3xx Reference Manual : SDADCPRE ==> SDPRE
  • LL SYSTEM
    • Add LL_SYSCFG_EnableIT_FPU_xxx functions
    • Replace LL_SYSCFG_TIM18_RMP_DMA2_CH4 and LL_SYSCFG_TIM18_RMP_DMA1_CH4 by LL_SYSCFG_TIM18_RMP_DMA2_CH5 and LL_SYSCFG_TIM18_RMP_DMA1_CH5
  • LL GPIO
    • Remove LL_GPIO_SPEED_FREQ_VERY_HIGH (GPIO_SPEED_FREQ_VERY_HIGH does not exist for STM32F3xx serie)
  • LL_TIM
    • Rename LL_TIM_TIM16_TI1_RMP defines : LL_TIM_TIM16_TI1_RMP_GPIO, LL_TIM_TIM16_TI1_RMP_RTC, LL_TIM_TIM16_TI1_RMP_HSE_32, LL_TIM_TIM16_TI1_RMP_MCO
    • Remove TIM_CR2_OIS2N, TIM_CR2_OIS3, TIM_CR2_OIS3N, TIM_CR2_OIS4 managment for STM32F373xC and STM32F378xx devices
    • Move LL_TIM_OCREF_CLR_INT_OCREF_CLR and LL_TIM_OCREF_CLR_INT_ETR defines under compilation switch (availability depends on devices)
    • New APIs to insure BDTR register initialization in a single write operation 
      • LL_TIM_BDTR_StructInit()
      • LL_TIM_BDTR_Init()
  • LL USART
    • Replace POSITION_VAL(xxx) macro by corresponding CMSIS_Pos definitions
  • LL HRTIM
    • Replace POSITION_VAL(xxx) macro by corresponding CMSIS_Pos definitions
    • Add shift operation in HRTIM_TIM_SetCompareMode()
  • LL_I2C
    • Replace POSITION_VAL(xxx) macro by corresponding CMSIS_Pos definitions

V1.3.0 / 01-July-2016

Main Changes

  • First official release supporting the Low Level drivers for the STM32F3xx serie:
    • Low Layer drivers APIs provide register level programming:
      they require deep knowledge of peripherals described in STM32F3xx Reference Manual.
    • Low Layer drivers are available for ADC, COMP, Cortex, CRC, DAC, DMA, EXTI, GPIO, HRTIM, I2C, IWDG, OPAMP, PWR,
      RCC, RTC, SPI, TIM, USART and WWDG peripherals
      and additional Low Level Bus, System and Utilities APIs.
    • Low Layer drivers APIs are implemented as static inline function in new Inc/stm32f3xx_ll_ppp.h files for PPP peripherals, there is no configuration file and each stm32f3xx_ll_ppp.h file must be included in user code.
  • Maintenance release to fix known defects and enhancements implementation.
  • HAL generic
    • Updated.
  • HAL ADC
    • Updated assert_param within HAL_ADCEx_MultiModeConfigChannel() function to avoid issue during ADC configuration change from multimode to independent mode.
  • HAL CRC
    • Updated HAL_CRC_DeInit() function (restored IDR Register to Reset value).
  • HAL GPIO
    • Updated definition of IS_GPIO_PIN private macro to cover full u32 bits.
  • HAL HRTIM
    • Updated HAL HRTIM Driver compliancy with MISRA C 2004 rules:
      • MISRA C 2004 rule 12.5 (operands of a logical && or || shall be primary-expressions).
      • MISRA C 2004 rule 15.3 (final clause of a switch statement shall be the default clause).
  • HAL I2C
    • Updated I2C driver documentation concerning I2C address management.
  • HAL IWDG
    • New simplified HAL IWDG driver: removed HAL_IWDG_Start(), HAL_IWDG_MspInit() and HAL_IWDG_GetState() APIs.
    • The API functions are: 
      • HAL_IWDG_Init(): this function insures the configuration and the start of the IWDG counter.
      • HAL_IWDG_Refresh(): this function insures the reload of the IWDG counter.
  • HAL PWR
    • Aligned Power Wake-Up pins EWUPx definitions on CMSIS definitions.
  • HAL RTC
    • Updated HAL_RTCEx_SetWakeUpTimer_IT() function by adding clear of Wake-Up flag before enabling the interrupt.
  • HAL SMBUS
    • Updated SMBUS driver documentation concerning SMBUS address management.
  • HAL SDADC
    • Updated HAL SDADC Driver compliancy with MISRA C 2004 rules:
      • MISRA C 2004 rule 10.3 (illegal explicit conversion from type "unsigned int" to "uint16_t *).
  • HAL SPI
    • Updated __SPI_HandleTypeDef definition by using __IO uint16_t type for TxXferCount and RxXferCount.
    • Updated SPI_2linesTxISR_8BIT() and SPI_2linesTxISR_16BIT() functions: added return so that SPI_2linesTxISR_8BITCRC() or SPI_2linesTxISR_16BITCRC() function is called from HAL_SPI_TransmitReceive_IT()
      when CRC is activated.
    • Updated SPI Driver compliancy with MISRA C 2004 rule 5.2 (identifiers in an inner scope shall not
      use the same name as an identifier in an outer scope)
      .
  • HAL WWDG
    • New simplified HAL WWDG driver: removed HAL_WWDG_Start(), HAL_WWDG_Start_IT(), HAL_WWDG_MspDeInit() and HAL_WWDG_GetState() APIs.
    • Updated HAL_WWDG_Refresh() API to remove counter parameter.
    • New field EWIMode in WWDG_InitTypeDef to specify need for Early Wakeup Interrupt.
    • The API functions are: HAL_WWDG_Init(), HAL_WWDG_MspInit(), HAL_WWDG_Refresh(), HAL_WWDG_IRQHandler() and HAL_WWDG_EarlyWakeupCallback().

V1.2.1 / 29-April-2016

Main Changes

  • Maintenance release to fix known defects and enhancements implementation.
  • HAL generic
    • Updated HAL Driver compliancy with MISRA C 2004 rules:
      • MISRA C 2004 rule 10.6 ('U' suffix applied to all constants of 'unsigned' type).
      • MISRA C 2004 rule 10.5 (bitwise operators ~ and <<).
      • MISRA C 2004 rule 12.6 (operands of logical operators (&&, || and !) should be effectively Boolean).
      • MISRA C 2004 rule 12.7 (bitwise operations not performed on signed integer types).
      • MISRA C 2004 rule 14.3 (a null statement shall only occur on a line by itself).
      • MISRA C 2004 rule 14.8 (statement forming the body of a switch, while, do … while or for statement shall be a compound statement).
      • MISRA C 2004 rule 15.3 (final clause of a switch statement shall be the default clause).
      • MISRA C 2004 rule 16.4 (identifiers used in the declaration and definition of a function shall be identical).
    • Updated HAL weak empty callbacks to prevent unused argument compilation warnings.
    • Updated stm32f3xx_hal_conf.h files:
      • Set HSE_STARTUP_TIMEOUT value to 100ms instead of 5000ms.
  • HAL
    • Changed uwTick to global to allow overwrite of HAL_IncTick().
  • HAL COMP
    • Added delay in COMP startup time required to reach propagation delay specification.
    • Added missing  __HAL_UNLOCK, __HAL_LOCK in HAL_COMP_Start().
    • Modified COMP_INVERTINGINPUT_SELECTION() macro as COMP inverting inputs selection, depends on COMPx instance.
  • HAL DAC
    • Updated DAC functions after DAC_CR_BOFFx/DAC_CR_OUTENx bit definition updates.
  • HAL DMA
    • Added __HAL_DMA_GET_COUNTER() macro returning the number of remaining data units in the current DMA Channel transfer.
    • Provided new function HAL_DMA_Abort_IT() to abort current DMA transfer under interrupt mode without polling for DMA enable bit.
  • HAL GPIO
    • Added macros to manage Fast Mode Plus on GPIOs.
  • HAL FMC
    • Removed private macro IS_FMC_PAGESIZE not supported by STM32F3xx serie.
  • HAL I2C
    • Aligned I2C driver with new state machine definition.
    • Updated __HAL_I2C_DISABLE_IT macro.
    • Used macro definition for I2C instances supporting Wakeup from Stop mode.
    • Added support of repeated start feature in case of multimaster mode (allow master to keep I2C communication with slave).
    • Updated WaitOnFlag management (timeout measurement should be always cumulative).
    • Optimized HAL_I2C_XX_IRQHandler() functions (read status registers only once).
    • Reworked DMA end process and I2C error management during DMA transfer.
    • Modified HAL_I2C_Master_Transmit to handle sending data of size 0.
    • Updated DMA Abort management: used new HAL_DMA_Abort() function and called HAL_I2C_ErrorCallback() when errors occur during DMA transfer.
  • HAL I2S
    • Removed support of I2S full-duplex feature on STM32F301x8 device.
  • HAL IRDA
    • Reviewed IRDA state machine to avoid cases where IRDA state is overwritten by IRDA IRQ.
    • Modified EIE bit setting in Tx and Rx transfers (Interrupt mode).
    • Modified IRDA_Receive_IT() to execute the RX flush request only in case no data is read from RDR.
    • Updated IRDA_SetConfig() function following UART Baudrate calculation update.
  • HAL FMC
    • Updated FMC_NORSRAM_Init() function (BurstAccessMode field configuration).
    • Added FMC_BCR1_CCLKEN in the BCR register clear mask used for FMC_NORSRAM_Init().
  • HAL OPAMP
    • Updated definitions of OPAMP Non Inverting Input constants.
  • HAL RCC
    • Performed optimizations for internal oscillators and PLL startup time.
    • Performed optimizations for HAL_RCC_ClockConfig(), HAL_RCCEx_PeriphCLKConfig functions.
    • Modified reset of Backup domain only if the RTC Clock source selection is modified from reset value.
    • Updated HAL_RCC_OscConfig() function (Reset HSEON/LSEON and HSEBYP/LSEBYP bits before configuring the HSE/LSE).
    • Corrected updates of SystemCoreClock variable within the HAL drivers.
    • Corrected invertion in LSE drive capability Bit definition.
    • Modified AHBPrescTable and APBPrescTable in HAL.
    • Removed RCC_CFGR_PLLNODIV bit definition from STM32F358xx, STM32F303xC and STM32F302xC devices.
    • Removed RCC_CSR_VREGRSTF bit definition in RCC_CSR register for STM32F303xC and STM32F303xE devices.
    • Removed USART2 and USART3 clock switch in RCC_CFGR3 register not supported by STM32F303x8, STM32F334x8
      and STM32F328xx devices and for STM32F301x8, STM32F302x8 and STM32F318xx devices.
    • Removed RCC_CSR_V18PWRRSTF bit definition in RCC_CSR register not supported by STM32F318xx, STM32F328xx, STM32F358xx, STM32F378xx and STM32F398xx devices.
    • Removed flag RCC_FLAG_RMV which is write only.
    • Added RCC_CFGR_xxxx_BITNUMBER definitions for portability between STM32 series.
    • Updated HAL_RCC_OscConfig() function to enable PWR only if necessary for LSE configuration.
  • HAL RTC
    • Added missing Tamper definitions (RTC_TAFCR register).
  • HAL SMARTCARD
    • Reviewed SMARTCARD state machine to avoid cases where SMARTCARD state is overwritten by SMARTCARD IRQ.
    • Modified SMARTCARD_Receive_IT() to execute the RX flush request only in case no data is read from RDR.
    • Added SMARTCARD_STOPBITS_0_5 definition used for smartcard mode.
    • Updated SMARTCARD_SetConfig() function following UART Baudrate calculation update.
  • HAL SPI
    • Updated HAL_SPI_TransmitReceive() function in slave mode to receive correctly the CRC when NSS pulse activated.
    • Added missing __IO in SPI_HandleTypeDef definition.
    • Updated IS_SPI_CRC_POLYNOMIAL macro definition as polynomial value should be odd only.
  • HAL TIM
    • Updated HAL_TIM_ConfigOCrefClear() function to manage correctly TIM state (BUSY, READY).
    • Used IS_TIM_HALL_INTERFACE_INSTANCE macro instead of IS_TIM_XOR_INSTANCE macro in
      HAL_TIMEx_HallSensor_xxx() functions.
    • Updated TIM_SLAVEMODE constants definitions using CMSIS bit definitions.
  • HAL TSC
    • Updated IO default state management.
  • HAL UART-USART
    • Updated UART Baudrate calculation (UART_DIV_SAMPLING8() and UART_DIV_SAMPLING16() macros).
    • Updated USART_SetConfig() function following UART Baudrate calculation update.
    • Reviewed UART state machine to avoid cases where UART state is overwritten by UART IRQ.
    • Removed USART2 and USART3 clock switch, not supported by STM32F303x8, STM32F334x8 and STM32F328xx devices
      and for STM32F301x8, STM32F302x8 and STM32F318xx devices.
    • Modified UART_Receive_IT() to execute the RX flush request only in case no data is read from RDR.
    • Corrected macro used in assert_param of HAL_LIN_SendBreak() function.
    • Added UART_STOPBITS_0_5/USART_STOPBITS_0_5 definitions used for synchronous mode.
  • HAL USB
    • Corrected double buffer implementation in PCD_SET_EP_DBUF1_CNT() macro.
  • HAL WWDG
    • Aligned WWDG registers bits naming between all STM32 series.

V1.2.0 / 13-November-2015

Main Changes

  • Performed HAL API alignment (macros/functions/constants renaming).
  • HAL generic
    • Provided/updated User Manual CHM files for STM32F334x8, STM32F373xC, STM32F303xC devices.
    • Updated HAL drivers to ensure compliancy w/ C++.
    • Made corrections for MISRA rule: bitwise operators ~ and << (MISRA C 2004 rule 10.5).
    • Used CMSIS mask definitions instead of hardcoded values.
    • Removed all the unused FLAG and IT assert macros.
    • Initialized Handle lock to HAL_UNLOCKED in HAL_PPP_Init() when state == HAL_PPP_STATE_RESET.
    • Updated stm32f3xx_hal_msp.c files:
      • Removed reference to MicroXplorer.
    • Updated stm32f3xx_hal_conf.h files:
      • Added LSE_STARTUP_TIMEOUT definition.
    • Updated stm32f3xx_hal_def.h file:
      • Added some generic defines (__NOINLINE).
      • Removed NULL redefinition.

  • HAL ADC
    • Updated HAL ADC state machine updated. States changed from fixed literals to bitfields.
    • Added 3 new HAL ADC functions: HAL_ADCEx_RegularStop(), HAL_ADCEx_RegularStop_IT(), HAL_ADCEx_RegularStop_DMA(), to perform a ADC group regular conversion stop
      while ADC group injected can remain with conversion on going.
    • Added 2 new HAL ADC functions: HAL_ADCEx_LevelOutOfWindow2Callback(), HAL_ADCEx_LevelOutOfWindow3Callback().
      The 3 analog watchdog has its own callback function (AWD1 callback function is unchanged with HAL_ADC_LevelOutOfWindowCallback()).
    • Updated ADC multimode (for devices with several ADC instances).
      Now takes into account mixed configuration: ADC group regular in multimode, ADC group injected in independent mode (and the opposite).
    • Updated ADC group injected use case when used with feature low power "auto-wait":
      updated function HAL_ADCEx_InjectedGetValue() which don’t clear anymore ADC flag EOS,
      and could cause some issues when using ADC group injected with high sampling rate.
  • HAL CAN
    • Added __HAL_UNLOCK(hcan) macro.
    • Modified CanTxMsgTypeDef/CanRxMsgTypeDef structures Data field.
    • Removed assert_param(IS_CAN_BANKNUMBER(sFilterConfig->BankNumber)) from HAL_CAN_ConfigFilter().
  • HAL CEC
    • Changed the HAL_CEC_ErrorTypeDef structure by separate defines.
    • Added CEC Flags Definitions(CEC_FLAG_TXACKE,…).
    • Add CEC Interrupts Definitions(CEC_IT_TXACKE,…).
    • Renamed CEC_ISR_XXX to CEC_FLAG_XXX.
    • Renamed CEC_IER_XXX to CEC_IT_XXX.
    • Added missing assert_param(IS_CEC_ALL_INSTANCE(hcec->Instance)); in In HAL_CEC_Init().
    • Added devices that supports CEC in device.h files.
    • Updated CEC Ready To Receive State in CEC_Transmit_IT().
    • Added new API HAL_CEC_GetReceivedFrameSize to get size of the received frame.
  • HAL COMP
    • Updated COMPEx_Output comment description and added test on instances.
    • Updated HAL_COMP_DeInit() to handle LOCKED state.
    • Added missing defines for COMP window mode (Sunfish).
  • HAL CORTEX
    • Removed __HAL_CORTEX_SYSTICKCLK_CONFIG macro, replaced by HAL_SYSTICK_CLKSourceConfig() function.
    • Added new CORTEX MPU APIs: HAL_MPU_ConfigRegion(), HAL_MPU_Disable(),HAL_MPU_Enable().
    • Added APIs to manage set/reset of SLEEPONEXIT and SEVONPEND bits in SCR register.
    • Added a check on negative parameter values for HAL_NVIC_DisableIRQ()/HAL_NVIC_EnableIRQ() functions.
  • HAL CRC
    • Updated CRC APIs comments.
    • Fixed MISRA C 2004 warnings (except 114, 12.4 and 14.7).
    • Updated __HAL_CRC_SET_IDR macro.
  • HAL DAC
    • Update HAL_DACEx_NoiseWaveGenerate() and HAL_DACEx_TriangleWaveGenerate()
      to reset DAC CR register before setting the new DAC config.
    • Added DAC_OUTPUTSWITCH_ENABLE constant.
  • HAL DMA
    • Reviewed HAL_DMA_PollForTransfer(). Added error code.
  • HAL FLASH/FMC
    • Added FLASH API HAL_FLASHEx_OBGetUserData() to get the value saved in User data option byte.
    • Aligned Return value of HAL_FLASH_EndOfOperationCallback function (0xFFFFFFF) when process is finished.
    • Updated function FLASH_OB_GetRDP() return value (FlagStatus (RESET,SET)).
    • Corrected way to set Flash read protection by performing an automatic option byte erase
      in FLASH_OB_RDP_LevelConfig function.
    • Updated Disable WRP to be compliant with other families.
    • Removed double definition of IS_OB_SDACD_VDD_MONITOR.
    • Added missing macro __HAL_FLASH_GET_LATENCY.
    • Corrected IS_OPTIONBYTE() macro in the case all option_OB are selected.
    • Updated HAL_NOR_GetStatus() (missing exit from waiting loop when timeout occurred).
    • Reviewed __ARRAY_ADDRESS macro and adapted tests to detect bad blocks.
    • Updated FMC_NORSRAM_Init()/FSMC_NORSRAM_Init() in order to not modify the default values
      for the reserved bits in the BTCR register.
  • HAL GPIO
    • Updated GPIO Output Speed literals naming to ensure HAL full compatibility.
    • Added only one define BSRR for BSRRH/BSRRL register.
    • Fixed issue to ensure interrupt mode is reset.
    • Reworked GPIO_GET_SOURCE() in order to check only existing GPIO bank.
    • Add new macro IS_GPIO_AF_INSTANCE to protect GPIO banks without alternate function register
      from being initialized as AF.
  • HAL HRTIM
    • Corrected bit definition for HRTIM_MCMPxR registers.
    • Corrected naming for delayed protection related constants.
    • Added missing assert in HAL_HRTIM_BurstModeConfig().
    • Added missing macros __HAL_FREEZE_ HRTIM1_DBGMCU(), __HAL_UNFREEZE_ HRTIM1_DBGMCU ()
      to stop the HRTIM when the core is halted (to control the DBGMCU_APB2_FZ.DBG_HRTIM1_STOP bitfield).
  • HAL I2C
    • Corrected wrong management of AF after NACK.
    • Renamed I2C_CR1_DFN to I2C_CR1_DNF.
    • Corrected management of I2C state in the function I2C_MasterTransmit_ISR().
    • Re-introduced the MACROs to manage the FM+ capapbility on some GPIOs.
  • HAL I2S
    • Added DMA circular mode support for the communication peripherals.
    • Updated I2S HAL_I2S_Transmit() API on busy flag.
  • HAL IRDA
    • Added DMA circular mode support for the communication peripherals.
    • Implemented __HAL_UART_FLUSH_DRREGISTER macro, required by the In-Application Programming (IAP)
      using the USART application.
    • Used new macro IS_UART_DMA_INSTANCE in assert_param() calls for IRDA DMA related primitives.
    • Changed UART TX-IT implementation to remove WaitOnFlag in ISR.
    • Fixed issue in IRDA DMA implementation: missed clear of the TC bit in the SR register.
    • Corrected definition of IS_IRDA_REQUEST_PARAMETER macro.
    • Modified Time Out management: report state READY instead of TIMEOUT.
      Time-out information is reported by function output parameter.
    • Corrected PCLK source for USART1.
  • HAL OPAMP
    • Updated HAL_OPAMP_DeInit() to handle LOCKED state.
    • Added __HAL_UNLOCK in HAL_OPAMP_DeInit.
    • Removed InvertingInput ASSERT in HAL_OPAMP_Init() as it is not needed in PGA mode.
    • Updated definition of OPAMP_CSR_UPDATE_PARAMETERS_INIT_MASK in OPAMP Init.
  • HAL PWR
    • Fixed MISRA C 2004 warnings, resort to reference SET_BIT, CLEAR_BIT macros.
    • Updated Device information when missing, systematically added USE_FULL_ASSERT compilation switch.
    • Added local variables addition to suppress warnings.
    • Removed useless regulator parameter setting in HAL_PWR_EnterSLEEPMode().
  • HAL RCC
    • Renamed RCC_CFGR3_USART1SW_PCLK to RCC_CFGR3_USART1SW_PCLKx according to devices.
    • Added missing flag for RCC_CSR_VREGRSTF bit.
    • Added missing flag for RCC_CFGR_MCOF feature.
    • Added missing macro __HAL_RCC_LSEDRIVE_CONFIG.
    • Renamed IS_RCC_PERIPHCLK to IS_RCC_PERIPHCLOCK.
    • Renamed __HAL_RCC_MCO_CONFIG to __HAL_RCC_MCO1_CONFIG.
    • Updated RCC APIs to add interface HAL_RCCEx_GetPeriphCLKFreq.
    • Implemented workaround to cover RCC limitation regarding Peripheral enable delay.
    • Modified HAL_RCCEx_PeriphCLKConfig to reset backup domain only if RTC clock source has been changed.
    • Reworked __HAL_RCC_LSE_CONFIG macro to manage correctly LSE_Bypass.
    • Followed specific procedure to enable HSE.
    • Updated HAL_RCC_OscConfig() to modify check on LSEState.
    • Added PLL_DIV1 define missing from the RCC_MCO_Clock_Source defgroup.
    • Added new macro __HAL_RCC_IS_PWR_CLOCK_ENABLED() to replace condition on Peripheral Clock enable status.
    • Added new macro __HAL_RCC_SYSCLK_CONFIG() to configure the SYSCLK clock source.
    • Fixed issue in HAL_RCC_OscConfig when RCC_OscInitStruct->HSEState = RCC_HSE_BYPASS.
  • HAL RTC(BKP)
    • Updated list of backup registers definition.
    • Updated Bits mask literals used in macros definition.
    • Renamed RTC_OUTPUT_REMAP_XX and RTC_TIMESTAMPPIN_XX macros.
    • Updated definition of __HAL_RTC_TAMPER_TIMESTAMP_EXTI_GET_FLAG.
    • Aligned different implementations of HAL_RTC_XXIRQHandler().
    • Check the behavior of flag WUTWF and corrected update of wakeup counter registers.
    • Added subsecond fration formula in HAL_RTC_GetTime() function.
  • HAL SDADC
    • Applied ReferenceVoltage parameter in HAL_SDADC_Init() wathever instance.
    • Added new macros __HAL_SDADC_ENABLE_IT(), __HAL_SDADC_GET_IT_SOURCE(), __HAL_SDADC_GET_FLAG().
  • HAL SMARTCARD
    • Implemented __HAL_UART_FLUSH_DRREGISTER macro, required by the In-Application Programming (IAP)
      using the USART application.
    • Changed UART TX-IT implementation to remove WaitOnFlag in ISR.
    • Added missing IDLE flag management.
    • Modified Time Out management: report state READY instead of TIMEOUT.
      Time-out information is reported by function output parameter.
    • Corrected PCLK source for USART1.
  • HAL SPI
    • Improved SPI performances.
    • Added Fit Bit feedback (with BSY flag check) for all the process.
    • Updated function descriptions.
    • Fixed issue on Rx 2line with DataSize8bit, even buffer size and CRC 8bit.
    • Added DMA circular mode support for the communication peripherals.
    • Removed DMA Tx Callback in case of RxOnly mode from HAL_SPI_TransmitReceive_DMA().
    • Added HAL_SPI_GetError().
  • HAL TIM
    • Corrected assert checks in HAL_TIM_ConfigClockSource() when setting internal clock source.
    • Removed useless assert() in TIM functions.
    • Updated implementation of __HAL_TIM_SET_COMPARE macro.
    • Updated Repetition counter bits definition.
    • Modified HAL_TIM_ConfigOCrefClear() to avoid possible overwrite of SMCR register.
    • Removed assert on trigger polarity in the case TIM_TS_TI1F_ED.
    • Removed HAL_TIM_SlaveConfigSynchronization_DMA() from HAL_TIM APIs.
    • Added TIM edge modification macros: TIM_SET_CAPTUREPOLARITY(), TIM_RESET_CAPTUREPOLARITY(), __HAL_TIM_SET_CAPTUREPOLARITY.
    • Added URS_ENABLE, URS_DISABLE macros.
    • Changed Time Out management: report state READY instead of TIMEOUT.
      Time-out information is reported by function output parameter.
    • Added new function HAL_TIM_SlaveConfigSynchronization_IT() to handle the trigger interrupt activation.
  • HAL TSC
    • Recovered IS_TSC_SS and IS_TSC_SSD macro definitions.
  • HAL UART-USART
    • Added DMA circular mode support for the communication peripherals.
    • Modified Time Out management: report state READY instead of TIMEOUT.
      Time-out information is reported by function output parameter.
    • Changed UART_DMATransmitCplt() implementation to remove WaitOnFlag in ISR.
    • Implemented __HAL_UART_FLUSH_DRREGISTER macro, required by the In-Application Programming (IAP)
      using the USART application.
    • Corrected behavior of HAL_UART_IRQ_Handler() (removed enabling/disabling of ERR IT source).
    • Added IS_UART_DMA_INSTANCE macro to sort UART instances supporting DMA communication.
    • Used new macro IS_UART_DMA_INSTANCE in assert_param() calls for UART DMA related primitives.
    • Changed UART TX-IT implementation to remove WaitOnFlag in ISR.
    • Added MACRO to UART HAL to control CTS and RTS from the customer application.
    • Renamed HAL_UART_WakeupCallback() in HAL_UARTEx_WakeupCallback().
    • Corrected setting of BRR register bit[3:0] when OVER8 sampling mode is used.
    • Corrected values used as parameter of __HAL_USART_CLEAR_IT() in HAL_USART_IRQHandler().
    • Updated HAL_USART_Init() to reach max frequencies (enable oversampling by 8).
    • Fixed issue in UART DMA implementation: missed clear of the TC bit in the SR register.
    • Added test in HAL_LIN_Init() as only 8-bit data length is available with USART Lin mode Data length.
    • Updated USART_IT_CM defined value.
    • Corrected PCLK source for USART1.
  • HAL USB/PCD
    • Corrected products define supporting USB feature.
    • Updated call to Double Buffering Counter Function.
    • Updated HAL PCD clear flag macros configuration.
    • Corrected issue in HAL_PCD_EP_Transmit() function, regarding the double-buffering mode for IN endpoints.
  • HAL WWDG
    • Updated IT macro management.

V1.1.1 / 19-June-2015

Main Changes

  • Fixed compilation warnings reported by TrueSTUDIO and SW4STM32 toolchains.

V1.1.0 / 12-Sept-2014

Main Changes

  • First official release of STM32F3xx HAL drivers for STM32F303xE, STM32F302xE and STM32F398xx devices.
  • HAL generic update
    • Add support of new devices STM32F302xE and STM32F398xx in STM32F3xx HAL drivers
  • HAL ADC
    • Empty weak function return HAL_ERROR
    • Misra error corrections
  • HAL CORTEX
    • Macro IS_SYSTICK_CLKSOURCE renamed IS_SYSTICK_CLK_SOURCE
  • HAL DAC
    • Empty weak function return HAL_ERROR
  • HAL IWDG
    • Minor updates (HAL coding rules)
  • HAL PCD
    • Changed IN/OUT EndPoint parameter array size (PCD Handle Structure)
  • HAL RCC
    • RCC_MCOSOURCE_PLLCLK_DIV1 define added to RCC_MCO_Clock_Source defgroup for the following devices: STM32F302xE, STM32F303xE, STM32F398xx, STM32F303x8, STM32F328xx, STM32F301x8, STM32F302x8 and STM32F318xx
  • HAL SPI
    • Removed HAL_ prefix from static function names
  • HAL TIM
    • Checked DeadTime value in debug mode
    • Add new macros __HAL_TIM_URS_ENABLE() and __HAL_TIM_URS_DISABLE()
  • HAL WWDG
    • Minor updates (HAL coding rules)
    • Added macro __HAL_WWDG_CLEAR_IT()
    • Use MODIFY_REG() macro to set Prescaler, Window and Counter registers within  HAL_WWDG_Init() 

V1.1.0RC2 / 25-August-2014

Main Changes

  • HAL generic update
    • General improvement of Doxygen Tags for CHM UM generation
    • Add support of new devices STM32F303xE in STM32F3xx HAL driver
  • HAL update (for STM32F303xE)
    • Add new defines for ADC trigger remapping (HAL_REMAPADCTRIGGER_x)
    • Add new defines for CCM RAM page write protection (up to 16 pages can be write protected)
    • Add new macro IS_HAL_REMAPADCTRIGGER()
    • Updated macro IS_HAL_SYSCFG_WP_PAGE ()
    • Add new macros to freeze/unfreeze TIM20 in debug mode: __HAL_FREEZE_TIM20_DBGMCU() and __HAL_UNFREEZE_TIM20_DBGMCU()
    • Add new macro to remap the FMC banks 1 and 2 at 0x00000000 : __HAL_FMC_BANK()
    • Add new macros to enable/disable ADC trigger remapping: __HAL_REMAPADCTRIGGER_ENABLE() and __HAL_REMAPADCTRIGGER_DISABLE()
  • HAL ADC update (for STM32F303xE)
    • Add new defines for TIM20 related ADC external triggers for regular groups (ADC_EXTERNALTRIGCONV_T20_x)
    • Add new defines for TIM20 related ADC external triggers for injected groups (ADC_EXTERNALTRIGINJECCONV_T20_x)
    • Updated macro __HAL_ADC_CFGR_EXTSEL() to take into account TIM20 related ADC triggers for regular channels
    • Updated macro __HAL_ADC_JSQR_JEXTSEL() to take into account TIM20 related ADC triggers for injected channels
  • HAL COMP update
    • Defect correction:
      • Missing assert param IS_COMP_TRIGGERMODE
    • STM32F303xE:
      • Add new defines for comparator output redirection: COMP_OUTPUT_TIM20BKIN, COMP_OUTPUT_TIM20BKIN2, COMP_OUTPUT_TIM1BKIN2_TIM8BKIN2_TIM20BKIN2 and COMP_OUTPUT_TIM20OCREFCLR
  • HAL FLASH update (for STM32F303xE)
    • Add new defines for write protection of pages 32 to 61 and 62-263 (OB_WRP_PAGESxxTOyy)
  • HAL GPIO update (for STM32F303xE)
    • Add new defines for TIM20 and FMC related AF: GPIO_AF2_TIM20, GPIO_AF3_TIM20, GPIO_AF6_TIM20 and GPIO_AF12_FMC
  • HAL IRDA update
    • TC enabled and TXE disabled at the end of TX in IT mode
  • HAL HAL NAND (STM32F303xE specific)
    • FMC: generic firmware to drive NAND memories mounted as external device
  • HAL NOR (STM32F303xE specific)
    • FMC: generic firmware to drive NOR memories mounted as external device
  • HAL PCCARD (STM32F303xE specific)
    • FMC: generic firmware to drive PCCARD memories mounted as external device
  • HAL PCD update 
    • Add new macros __HAL_USB_EXTI_GET_FLAG() , __HAL_USB_EXTI_CLEAR_FLAG(), __HAL_USB_EXTI_SET_RISING_EDGE_TRIGGER(), __HAL_USB_EXTI_SET_FALLING_EDGE_TRIGGER() and _HAL_USB_EXTI_SET_FALLINGRISING_TRIGGER()
  • HAL PWR update 
    • PVD feature need falling/rising Event modes
      • Rename  defines: 
        • PWR_MODE_EVT to PWR_PVD_MODE_NORMAL
        • PWR_MODE_IT_RISING to PWR_PVD_MODE_IT_RISING
        • PWR_MODE_IT_FALLING to PWR_PVD_MODE_IT_FALLING
        • PWR_MODE_IT_RISING_FALLING to PWR_PVD_MODE_IT_RISING_FALLING
        • PWR_MODE_IT_RISING to PWR_PVD_MODE_IT_RISING
      • Add new defines: PWR_PVD_MODE_EVENT_RISING, PWR_PVD_MODE_EVENT_FALLING and PWR_PVD_MODE_EVENT_RISING_FALLING
      • Changed __HAL_PVD_EXTI_ENABLE_IT() macro  definition: __EXTILINE__ argument no longer needed (PWR_EXTI_LINE_PVD is used implicitly)
      • Changed __HAL_PVD_EXTI_DISABLE_IT() macro definition: __EXTILINE__ argument no longer needed (PWR_EXTI_LINE_PVD is used implicitly)
      • Changed __HAL_PVD_EXTI_GET_FLAG () macro definition: __EXTILINE__ argument no longer needed (PWR_EXTI_LINE_PVD is used implicitly)
      • Changed _HAL_PVD_EXTI_CLEAR_FLAG () macro definition: __EXTILINE__ argument no longer needed (PWR_EXTI_LINE_PVD is used implicitly)
      • Add new macros __HAL_PWR_PVD_EXTI_ENABLE_EVENT(), __HAL_PWR_PVD_EXTI_DISABLE_EVENT(),  __HAL_PWR_PVD_EXTI_CLEAR_EGDE_TRIGGER(), __HAL_PWR_PVD_EXTI_SET_FALLING_EGDE_TRIGGER() and __HAL_PWR_PVD_EXTI_SET_RISING_EDGE_TRIGGER()
  • HAL RCC update (for STM32F303xE)
    • RCC_OcsInitTypeDef and RCC_PLLInitTypeDef definitions are now product dependent: 
      • STM32F303xE:
        • Added PREDIV field to RCC_PLLInitTypeDef: used to set the desired pre-division factor whatever the PLL clock source is (HSI or HSE).
        • Removed field HSEPredivValue from RCC_OscInitTypeDef (replaced by PREDIV field in RCC_PLLInitTypeDef)
      • Other F3 products: no change in RCC_OcsInitTypeDef and RCC_PLLInitTypeDef definitions
    • Add new definition of RCC_PeriphCLKInitTypeDef  to fit STM32F303xE  clock selection capabilities (e.g select TIM20 clock source)
    • Add new defines to select the pre-division factor (RCC_PREDIV_DIVx)
    • Add new defines to set TIM20 clock source (RCC_PERIPHCLK_TIM20, RCC_TIM20CLK_HCLK and RCC_TIM20CLK_PLLCLK)
    • Add new defnes to set TIM3 & TIM4 clock source  (RCC_PERIPHCLK_TIM34, RCC_TIM34CLK_HCLK, RCC_TIM34CLK_PCLK)
    • Add FMC related macros: __FMC_CLK_ENABLE(), __FMC_CLK_DISABLE(), __FMC_FORCE_RESET() and __FMC_RELEASE_RESET()
    • Add GPIO port G related macros: __GPIOG_CLK_ENABLE(), __GPIOG_CLK_DISABLE(), __ GPIOG _FORCE_RESET() and __GPIOG _RELEASE_RESET()
    • Add GPIO port H related macros:_ __GPIOH_CLK_ENABLE(), __GPIOH_CLK_DISABLE(), __FMC_ GPIOH _RESET() and __GPIOH _RELEASE_RESET()
    • Add SPI4 related macros:  __SPI4_CLK_ENABLE(), __SPI4_CLK_DISABLE(), __ SPI4_FORCE_RESET() and __SPI4_RELEASE_RESET()
    • Add TIM20 related macros: __TIM20_CLK_ENABLE(), __TIM20_CLK_DISABLE(), __ TIM20_FORCE_RESET() and __TIM20_RELEASE_RESET(), __HAL_RCC_TIM20_CONFIG() , __HAL_RCC_GET_TIM20_SOURCE()
    • Add new macro to set/get the clock source of TIM3 & TIM4: __HAL_RCC_TIM34_CONFIG() and  __HAL_RCC_GET_TIM34_SOURCE()
  • HAL SMARTCARD update
    • Change SMARTCARD_AdvFeatureConfig() from exported to static private function
    • TC enabled and TXE disabled at the end of TX in IT mode

  • HAL SMBUS update
    • Fix wrong State after a PEC failed
    • Fix slave acknowledge issue

  • HAL SPI update
    • Fix CodeSonar warning: unreachable Call in SPI_CloseRxTx_ISR()

  • HAL SRAM (STM32F303xE specific)
    • FMC: generic firmware to drive SRAM memories mounted as external device
  • HAL TIM update (for STM32F303xE)
    • Add defines to set TIM20 option register (link from analog watchdog and TIM20 ETR)
  • HAL UART update
    • TC enabled and TXE disabled at the end of TX in IT mode
  • HAL USART update
    • TC enabled and TXE disabled at the end of TX in IT mode

V1.0.1 / 18-June-2014

Main Changes

  • HAL generic update

    • Fix flag clear procedure: use atomic write operation "=" instead of ready-modify-write operation "|=" or "&="
    • Fix on Timeout management, Timeout value set to 0 passed to API automatically exits the function after checking the flag without any wait.
    • Add new macro __HAL_RESET_HANDLE_STATE to reset a given handle state.
  • HAL ADC update

    • Rename defines:
      • ADC_EXTERNALTRIGCONV_Ext_IT11 to ADC_EXTERNALTRIGCONV_EXT_IT11
      • ADC_EXTERNALTRIGCONV_Ext_IT12 to ADC_EXTERNALTRIGCONV_EXT_IT12
    • Fix define ADC_SOFTWARE_START
    • Update external trigger defines to remove HRTIM triggers for STM32F328xx and TIM8 triggers for STM32F302xC
    • Add ADC1_2_EXTERNALTRIG_T4_CC4 for STM32F303x8 and STM32F328xx
  • HAL CEC update

    • Process no more locked during the transmission in interrupt mode. 
  • HAL COMP update

    • Fix on 32-bit register COMP CSR accesses for STM32F373xC and STM32F378xx devices.
    • Add new defines for STM32F373xC and STM32F378xx comparators: 
COMP_OUTPUT_TIM3IC1, COMP_OUTPUT_TIM3OCREFCLR, COMP_OUTPUT_TIM2IC4 and COMP_OUTPUT_TIM2OCREFCLR 
instead of previous defines 
COMP_OUTPUT_COMP1_TIM3IC1, COMP_OUTPUT_COMP1_TIM3OCREFCLR, COMP_OUTPUT_COMP1_TIM2IC4,  COMP_OUTPUT_COMP1_TIM2OCREFCLR,
COMP_OUTPUT_COMP2_TIM3IC1, COMP_OUTPUT_COMP2_TIM3OCREFCLR, COMP_OUTPUT_COMP2_TIM2IC4,  COMP_OUTPUT_COMP2_TIM2OCREFCLR.
  • HAL DMA update

    • Fix in HAL_DMA_PollForTransfer() to set error code HAL_DMA_ERROR_TE in case of HAL_ERROR status 
  • HAL GPIO update

    • Fix GPIO_AF5_SPI1 define instead of GPIO_AF5_SPI1 for STM32F303x8 device. 
  • HAL HRTIM update

    • HRTIM peripheral not available for STM32F328xx device.
    • Fix macros __HAL_HRTIM_CLEAR_FLAG, __HAL_HRTIM_MASTER_CLEAR_FLAG and __HAL_HRTIM_TIMER_CLEAR_FLAG
  • HAL I2C update

    • Add management of NACK event in Master transmitter mode and Slave transmitter/receiver modes (only in polling mode), in that case the current transfer is stopped.
  • HAL IRDA update

    • Add new enum typedef IRDA_ClockSourceTypeDef
    • Add new macro __HAL_IRDA_GETCLOCKSOURCE
    • Change in HAL_IRDA_Transmit_IT() to enable IRDA_IT_TXE instead of IRDA_IT_TC.
    • Process no more locked during the transmission in interrupt mode.
  • HAL OPAMP update

    • __SYSCFG_CLK_ENABLE() is now handled internally in HAL_OPAMP_Init() and no more in user HAL_OPAMP_MspInit().
  • HAL PCD update

    • Add new macro __HAL_USB_EXTI_GENERATE_SWIT

  • HAL PWR update

    • Fix in HAL_PWR_EnterSTANDBYMode() to not clear Wakeup flag (WUF), which need to be cleared at application level before to call this function
  • HAL RCC update

    • Change for STM32F303x8, STM32F334x8 and STM32F328xx devices:
      • Add missing macro __DAC2_FORCE_RESET
      • Rename RCC_USART1CLKSOURCE_PCLK2 into RCC_USART1CLKSOURCE_PCLK1
    • Remove HRTIM1 peripheral and clocking macros for STM32F328xx device.
    • Fix HSI Calibration issue when selected as SYSCLK
  • HAL SMARTCARD update

    • Change in HAL_SMARTCARD_Transmit_IT() to enable SMARTCARD_IT_TXE instead of SMARTCARD_IT_TC.
    • Process no more locked during the transmission in interrupt mode.
  • HAL SMBUS update

    • Fix Slave acknowledge issue: Slave should ack each bit and so stretch the line till the bit is not ack
  • HAL TIM update

    • Fix macro __HAL_TIM_PRESCALER
  • HAL TSC update

    • Fix define TSC_ACQ_MODE_SYNCHRO
  • HAL UART update

    • Change in HAL_LIN_Init() parameter BreakDetectLength to uint32_t
    • Change in HAL_UART_Transmit_IT() to enable UART_IT_TXE instead of UART_IT_TC.
    • Process no more locked during the transmission in interrupt mode.
  • HAL USART update

    • Change USART_InitTypeDef fields to uint32_t type
    • Rename __USART_ENABLE and __USART_DISABLE macros to respectively __HAL_USART_ENABLE and __HAL_USART_DISABLE
    • Change in HAL_USART_Transmit_IT() to enable USART_IT_TXE instead of USART_IT_TC.
    • Process no more locked during the transmission in interrupt mode.
    • Change in HAL_USART_TransmitReceive_DMA() to manage DMA half transfer mode
 

V1.0.0 / 06-May-2014

Main Changes

  • First official release of STM32F3xx HAL drivers for STM32F301x6/x8, STM32F302x6/x8, STM32F302xB/xC, STM32F303x6/x8, STM32F373xB/xC, STM32F334x4/x6/x8STM32F318xx, STM32F328xx, STM32F358xx and STM32F378xx devices.

License

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 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 STMicroelectronics nor the names of its contributors may be used to endorse or promote products derived
       from this software without specific prior written permission.

THIS SOFTWARE IS PROVIDED BY THE COPYRIGHT HOLDERS AND CONTRIBUTORS "AS IS" AND ANY EXPRESS OR IMPLIED WARRANTIES, INCLUDING, BUT NOT LIMITED TO, THE IMPLIED WARRANTIES OF MERCHANTABILITY AND FITNESS FOR A PARTICULAR PURPOSE ARE DISCLAIMED. IN NO EVENT SHALL THE COPYRIGHT HOLDER 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.

For complete documentation on STM32 Microcontrollers visit www.st.com/STM32