parent
35ca569c84
commit
1da411fd7b
|
@ -60,7 +60,6 @@ void enableGPIOPowerUsageAndNoiseReductions(void)
|
||||||
__HAL_RCC_BKPSRAM_CLK_ENABLE();
|
__HAL_RCC_BKPSRAM_CLK_ENABLE();
|
||||||
__HAL_RCC_DTCMRAMEN_CLK_ENABLE();
|
__HAL_RCC_DTCMRAMEN_CLK_ENABLE();
|
||||||
__HAL_RCC_DMA2_CLK_ENABLE();
|
__HAL_RCC_DMA2_CLK_ENABLE();
|
||||||
__HAL_RCC_DMA2D_CLK_ENABLE();
|
|
||||||
__HAL_RCC_USB_OTG_HS_CLK_ENABLE();
|
__HAL_RCC_USB_OTG_HS_CLK_ENABLE();
|
||||||
__HAL_RCC_USB_OTG_HS_ULPI_CLK_ENABLE();
|
__HAL_RCC_USB_OTG_HS_ULPI_CLK_ENABLE();
|
||||||
__HAL_RCC_GPIOA_CLK_ENABLE();
|
__HAL_RCC_GPIOA_CLK_ENABLE();
|
||||||
|
@ -72,8 +71,11 @@ void enableGPIOPowerUsageAndNoiseReductions(void)
|
||||||
__HAL_RCC_GPIOG_CLK_ENABLE();
|
__HAL_RCC_GPIOG_CLK_ENABLE();
|
||||||
__HAL_RCC_GPIOH_CLK_ENABLE();
|
__HAL_RCC_GPIOH_CLK_ENABLE();
|
||||||
__HAL_RCC_GPIOI_CLK_ENABLE();
|
__HAL_RCC_GPIOI_CLK_ENABLE();
|
||||||
|
#ifndef STM32F722xx
|
||||||
|
__HAL_RCC_DMA2D_CLK_ENABLE();
|
||||||
__HAL_RCC_GPIOJ_CLK_ENABLE();
|
__HAL_RCC_GPIOJ_CLK_ENABLE();
|
||||||
__HAL_RCC_GPIOK_CLK_ENABLE();
|
__HAL_RCC_GPIOK_CLK_ENABLE();
|
||||||
|
#endif
|
||||||
|
|
||||||
//APB1
|
//APB1
|
||||||
__HAL_RCC_TIM2_CLK_ENABLE();
|
__HAL_RCC_TIM2_CLK_ENABLE();
|
||||||
|
@ -95,13 +97,15 @@ void enableGPIOPowerUsageAndNoiseReductions(void)
|
||||||
__HAL_RCC_I2C1_CLK_ENABLE();
|
__HAL_RCC_I2C1_CLK_ENABLE();
|
||||||
__HAL_RCC_I2C2_CLK_ENABLE();
|
__HAL_RCC_I2C2_CLK_ENABLE();
|
||||||
__HAL_RCC_I2C3_CLK_ENABLE();
|
__HAL_RCC_I2C3_CLK_ENABLE();
|
||||||
__HAL_RCC_I2C4_CLK_ENABLE();
|
|
||||||
__HAL_RCC_CAN1_CLK_ENABLE();
|
__HAL_RCC_CAN1_CLK_ENABLE();
|
||||||
__HAL_RCC_CAN2_CLK_ENABLE();
|
|
||||||
__HAL_RCC_CEC_CLK_ENABLE();
|
|
||||||
__HAL_RCC_DAC_CLK_ENABLE();
|
__HAL_RCC_DAC_CLK_ENABLE();
|
||||||
__HAL_RCC_UART7_CLK_ENABLE();
|
__HAL_RCC_UART7_CLK_ENABLE();
|
||||||
__HAL_RCC_UART8_CLK_ENABLE();
|
__HAL_RCC_UART8_CLK_ENABLE();
|
||||||
|
#ifndef STM32F722xx
|
||||||
|
__HAL_RCC_I2C4_CLK_ENABLE();
|
||||||
|
__HAL_RCC_CAN2_CLK_ENABLE();
|
||||||
|
__HAL_RCC_CEC_CLK_ENABLE();
|
||||||
|
#endif
|
||||||
|
|
||||||
//APB2
|
//APB2
|
||||||
__HAL_RCC_TIM1_CLK_ENABLE();
|
__HAL_RCC_TIM1_CLK_ENABLE();
|
||||||
|
@ -118,9 +122,11 @@ void enableGPIOPowerUsageAndNoiseReductions(void)
|
||||||
__HAL_RCC_TIM10_CLK_ENABLE();
|
__HAL_RCC_TIM10_CLK_ENABLE();
|
||||||
__HAL_RCC_TIM11_CLK_ENABLE();
|
__HAL_RCC_TIM11_CLK_ENABLE();
|
||||||
__HAL_RCC_SPI5_CLK_ENABLE();
|
__HAL_RCC_SPI5_CLK_ENABLE();
|
||||||
__HAL_RCC_SPI6_CLK_ENABLE();
|
|
||||||
__HAL_RCC_SAI1_CLK_ENABLE();
|
__HAL_RCC_SAI1_CLK_ENABLE();
|
||||||
__HAL_RCC_SAI2_CLK_ENABLE();
|
__HAL_RCC_SAI2_CLK_ENABLE();
|
||||||
|
#ifndef STM32F722xx
|
||||||
|
__HAL_RCC_SPI6_CLK_ENABLE();
|
||||||
|
#endif
|
||||||
//
|
//
|
||||||
// GPIO_InitTypeDef GPIO_InitStructure;
|
// GPIO_InitTypeDef GPIO_InitStructure;
|
||||||
// GPIO_StructInit(&GPIO_InitStructure);
|
// GPIO_StructInit(&GPIO_InitStructure);
|
||||||
|
|
|
@ -2,9 +2,9 @@
|
||||||
******************************************************************************
|
******************************************************************************
|
||||||
* @file startup_stm32f722xx.s
|
* @file startup_stm32f722xx.s
|
||||||
* @author MCD Application Team
|
* @author MCD Application Team
|
||||||
* @version nil - pending release
|
* @version V1.2.0
|
||||||
* @date
|
* @date 30-December-2016
|
||||||
* @brief STM32F722xx Devices vector table for GCC toolchain based application.
|
* @brief STM32F722xx Devices vector table for GCC based toolchain.
|
||||||
* This module performs:
|
* This module performs:
|
||||||
* - Set the initial SP
|
* - Set the initial SP
|
||||||
* - Set the initial PC == Reset_Handler,
|
* - Set the initial PC == Reset_Handler,
|
||||||
|
@ -73,10 +73,12 @@ defined in linker script */
|
||||||
* @retval : None
|
* @retval : None
|
||||||
*/
|
*/
|
||||||
|
|
||||||
.section .text.Reset_Handler
|
.section .text.Reset_Handler
|
||||||
.weak Reset_Handler
|
.weak Reset_Handler
|
||||||
.type Reset_Handler, %function
|
.type Reset_Handler, %function
|
||||||
Reset_Handler:
|
Reset_Handler:
|
||||||
|
ldr sp, =_estack /* set stack pointer */
|
||||||
|
|
||||||
/* Copy the data segment initializers from flash to SRAM */
|
/* Copy the data segment initializers from flash to SRAM */
|
||||||
movs r1, #0
|
movs r1, #0
|
||||||
b LoopCopyDataInit
|
b LoopCopyDataInit
|
||||||
|
@ -105,21 +107,13 @@ LoopFillZerobss:
|
||||||
cmp r2, r3
|
cmp r2, r3
|
||||||
bcc FillZerobss
|
bcc FillZerobss
|
||||||
|
|
||||||
/*FPU settings*/
|
/* Call the clock system intitialization function.*/
|
||||||
ldr r0, =0xE000ED88 /* Enable CP10,CP11 */
|
|
||||||
ldr r1,[r0]
|
|
||||||
orr r1,r1,#(0xF << 20)
|
|
||||||
str r1,[r0]
|
|
||||||
|
|
||||||
/* Call the clock system initialization function.*/
|
|
||||||
bl SystemInit
|
bl SystemInit
|
||||||
|
/* Call static constructors */
|
||||||
|
// bl __libc_init_array
|
||||||
/* Call the application's entry point.*/
|
/* Call the application's entry point.*/
|
||||||
bl main
|
bl main
|
||||||
bx lr
|
bx lr
|
||||||
|
|
||||||
LoopForever:
|
|
||||||
b LoopForever
|
|
||||||
|
|
||||||
.size Reset_Handler, .-Reset_Handler
|
.size Reset_Handler, .-Reset_Handler
|
||||||
|
|
||||||
/**
|
/**
|
||||||
|
@ -141,7 +135,7 @@ Infinite_Loop:
|
||||||
* 0x0000.0000.
|
* 0x0000.0000.
|
||||||
*
|
*
|
||||||
*******************************************************************************/
|
*******************************************************************************/
|
||||||
.section .isr_vector,"a",%progbits
|
.section .isr_vector,"a",%progbits
|
||||||
.type g_pfnVectors, %object
|
.type g_pfnVectors, %object
|
||||||
.size g_pfnVectors, .-g_pfnVectors
|
.size g_pfnVectors, .-g_pfnVectors
|
||||||
|
|
||||||
|
@ -149,6 +143,7 @@ Infinite_Loop:
|
||||||
g_pfnVectors:
|
g_pfnVectors:
|
||||||
.word _estack
|
.word _estack
|
||||||
.word Reset_Handler
|
.word Reset_Handler
|
||||||
|
|
||||||
.word NMI_Handler
|
.word NMI_Handler
|
||||||
.word HardFault_Handler
|
.word HardFault_Handler
|
||||||
.word MemManage_Handler
|
.word MemManage_Handler
|
||||||
|
@ -226,12 +221,12 @@ g_pfnVectors:
|
||||||
.word DMA2_Stream2_IRQHandler /* DMA2 Stream 2 */
|
.word DMA2_Stream2_IRQHandler /* DMA2 Stream 2 */
|
||||||
.word DMA2_Stream3_IRQHandler /* DMA2 Stream 3 */
|
.word DMA2_Stream3_IRQHandler /* DMA2 Stream 3 */
|
||||||
.word DMA2_Stream4_IRQHandler /* DMA2 Stream 4 */
|
.word DMA2_Stream4_IRQHandler /* DMA2 Stream 4 */
|
||||||
.word ETH_IRQHandler /* Ethernet */
|
.word 0 /* Reserved */
|
||||||
.word ETH_WKUP_IRQHandler /* Ethernet Wakeup through EXTI line */
|
.word 0 /* Reserved */
|
||||||
.word 0 /* CAN2 TX */
|
.word 0 /* Reserved */
|
||||||
.word 0 /* CAN2 RX0 */
|
.word 0 /* Reserved */
|
||||||
.word 0 /* CAN2 RX1 */
|
.word 0 /* Reserved */
|
||||||
.word 0 /* CAN2 SCE */
|
.word 0 /* Reserved */
|
||||||
.word OTG_FS_IRQHandler /* USB OTG FS */
|
.word OTG_FS_IRQHandler /* USB OTG FS */
|
||||||
.word DMA2_Stream5_IRQHandler /* DMA2 Stream 5 */
|
.word DMA2_Stream5_IRQHandler /* DMA2 Stream 5 */
|
||||||
.word DMA2_Stream6_IRQHandler /* DMA2 Stream 6 */
|
.word DMA2_Stream6_IRQHandler /* DMA2 Stream 6 */
|
||||||
|
@ -243,26 +238,32 @@ g_pfnVectors:
|
||||||
.word OTG_HS_EP1_IN_IRQHandler /* USB OTG HS End Point 1 In */
|
.word OTG_HS_EP1_IN_IRQHandler /* USB OTG HS End Point 1 In */
|
||||||
.word OTG_HS_WKUP_IRQHandler /* USB OTG HS Wakeup through EXTI */
|
.word OTG_HS_WKUP_IRQHandler /* USB OTG HS Wakeup through EXTI */
|
||||||
.word OTG_HS_IRQHandler /* USB OTG HS */
|
.word OTG_HS_IRQHandler /* USB OTG HS */
|
||||||
.word DCMI_IRQHandler /* DCMI */
|
|
||||||
.word 0 /* Reserved */
|
.word 0 /* Reserved */
|
||||||
.word RNG_IRQHandler /* Rng */
|
.word 0 /* Reserved */
|
||||||
|
.word RNG_IRQHandler /* RNG */
|
||||||
.word FPU_IRQHandler /* FPU */
|
.word FPU_IRQHandler /* FPU */
|
||||||
.word 0 /* UART7 */
|
.word UART7_IRQHandler /* UART7 */
|
||||||
.word 0 /* UART8 */
|
.word UART8_IRQHandler /* UART8 */
|
||||||
.word 0 /* SPI4 */
|
.word SPI4_IRQHandler /* SPI4 */
|
||||||
.word 0 /* SPI5 */
|
.word SPI5_IRQHandler /* SPI5 */
|
||||||
.word 0 /* SPI6 */
|
.word 0 /* Reserved */
|
||||||
.word SAI1_IRQHandler /* SAI1 */
|
.word SAI1_IRQHandler /* SAI1 */
|
||||||
.word 0 /* Reserved */
|
.word 0 /* Reserved */
|
||||||
.word 0 /* Reserved */
|
.word 0 /* Reserved */
|
||||||
.word DMA2D_IRQHandler /* DMA2D */
|
.word 0 /* Reserved */
|
||||||
.word SAI2_IRQHandler /* SAI2 */
|
.word SAI2_IRQHandler /* SAI2 */
|
||||||
.word QUADSPI_IRQHandler /* QUADSPI */
|
.word QUADSPI_IRQHandler /* QUADSPI */
|
||||||
.word 0 /* LPTIM1 */
|
.word LPTIM1_IRQHandler /* LPTIM1 */
|
||||||
.word CEC_IRQHandler /* HDMI_CEC */
|
.word 0 /* Reserved */
|
||||||
.word 0 /* I2C4 Event */
|
.word 0 /* Reserved */
|
||||||
.word 0 /* I2C4 Error */
|
.word 0 /* Reserved */
|
||||||
.word SPDIF_RX_IRQHandler /* SPDIF_RX */
|
.word 0 /* Reserved */
|
||||||
|
.word 0 /* Reserved */
|
||||||
|
.word 0 /* Reserved */
|
||||||
|
.word 0 /* Reserved */
|
||||||
|
.word 0 /* Reserved */
|
||||||
|
.word 0 /* Reserved */
|
||||||
|
.word SDMMC2_IRQHandler /* SDMMC2 */
|
||||||
|
|
||||||
/*******************************************************************************
|
/*******************************************************************************
|
||||||
*
|
*
|
||||||
|
@ -481,11 +482,8 @@ g_pfnVectors:
|
||||||
.weak DMA2_Stream4_IRQHandler
|
.weak DMA2_Stream4_IRQHandler
|
||||||
.thumb_set DMA2_Stream4_IRQHandler,Default_Handler
|
.thumb_set DMA2_Stream4_IRQHandler,Default_Handler
|
||||||
|
|
||||||
.weak ETH_IRQHandler
|
.weak DMA2_Stream4_IRQHandler
|
||||||
.thumb_set ETH_IRQHandler,Default_Handler
|
.thumb_set DMA2_Stream4_IRQHandler,Default_Handler
|
||||||
|
|
||||||
.weak ETH_WKUP_IRQHandler
|
|
||||||
.thumb_set ETH_WKUP_IRQHandler,Default_Handler
|
|
||||||
|
|
||||||
.weak OTG_FS_IRQHandler
|
.weak OTG_FS_IRQHandler
|
||||||
.thumb_set OTG_FS_IRQHandler,Default_Handler
|
.thumb_set OTG_FS_IRQHandler,Default_Handler
|
||||||
|
@ -520,32 +518,38 @@ g_pfnVectors:
|
||||||
.weak OTG_HS_IRQHandler
|
.weak OTG_HS_IRQHandler
|
||||||
.thumb_set OTG_HS_IRQHandler,Default_Handler
|
.thumb_set OTG_HS_IRQHandler,Default_Handler
|
||||||
|
|
||||||
.weak DCMI_IRQHandler
|
|
||||||
.thumb_set DCMI_IRQHandler,Default_Handler
|
|
||||||
|
|
||||||
.weak RNG_IRQHandler
|
.weak RNG_IRQHandler
|
||||||
.thumb_set RNG_IRQHandler,Default_Handler
|
.thumb_set RNG_IRQHandler,Default_Handler
|
||||||
|
|
||||||
.weak FPU_IRQHandler
|
.weak FPU_IRQHandler
|
||||||
.thumb_set FPU_IRQHandler,Default_Handler
|
.thumb_set FPU_IRQHandler,Default_Handler
|
||||||
|
|
||||||
|
.weak UART7_IRQHandler
|
||||||
|
.thumb_set UART7_IRQHandler,Default_Handler
|
||||||
|
|
||||||
|
.weak UART8_IRQHandler
|
||||||
|
.thumb_set UART8_IRQHandler,Default_Handler
|
||||||
|
|
||||||
|
.weak SPI4_IRQHandler
|
||||||
|
.thumb_set SPI4_IRQHandler,Default_Handler
|
||||||
|
|
||||||
|
.weak SPI5_IRQHandler
|
||||||
|
.thumb_set SPI5_IRQHandler,Default_Handler
|
||||||
|
|
||||||
.weak SAI1_IRQHandler
|
.weak SAI1_IRQHandler
|
||||||
.thumb_set SAI1_IRQHandler,Default_Handler
|
.thumb_set SAI1_IRQHandler,Default_Handler
|
||||||
|
|
||||||
.weak DMA2D_IRQHandler
|
|
||||||
.thumb_set DMA2D_IRQHandler,Default_Handler
|
|
||||||
|
|
||||||
.weak SAI2_IRQHandler
|
.weak SAI2_IRQHandler
|
||||||
.thumb_set SAI2_IRQHandler,Default_Handler
|
.thumb_set SAI2_IRQHandler,Default_Handler
|
||||||
|
|
||||||
.weak QUADSPI_IRQHandler
|
.weak QUADSPI_IRQHandler
|
||||||
.thumb_set QUADSPI_IRQHandler,Default_Handler
|
.thumb_set QUADSPI_IRQHandler,Default_Handler
|
||||||
|
|
||||||
.weak CEC_IRQHandler
|
.weak LPTIM1_IRQHandler
|
||||||
.thumb_set CEC_IRQHandler,Default_Handler
|
.thumb_set LPTIM1_IRQHandler,Default_Handler
|
||||||
|
|
||||||
.weak SPDIF_RX_IRQHandler
|
.weak SDMMC2_IRQHandler
|
||||||
.thumb_set SPDIF_RX_IRQHandler,Default_Handler
|
.thumb_set SDMMC2_IRQHandler,Default_Handler
|
||||||
|
|
||||||
/************************ (C) COPYRIGHT STMicroelectronics *****END OF FILE****/
|
/************************ (C) COPYRIGHT STMicroelectronics *****END OF FILE****/
|
||||||
|
|
||||||
|
|
|
@ -2,8 +2,8 @@
|
||||||
******************************************************************************
|
******************************************************************************
|
||||||
* @file startup_stm32f745xx.s
|
* @file startup_stm32f745xx.s
|
||||||
* @author MCD Application Team
|
* @author MCD Application Team
|
||||||
* @version V1.1.0
|
* @version V1.2.0
|
||||||
* @date 22-April-2016
|
* @date 30-December-2016
|
||||||
* @brief STM32F745xx Devices vector table for GCC toolchain based application.
|
* @brief STM32F745xx Devices vector table for GCC toolchain based application.
|
||||||
* This module performs:
|
* This module performs:
|
||||||
* - Set the initial SP
|
* - Set the initial SP
|
||||||
|
@ -73,10 +73,12 @@ defined in linker script */
|
||||||
* @retval : None
|
* @retval : None
|
||||||
*/
|
*/
|
||||||
|
|
||||||
.section .text.Reset_Handler
|
.section .text.Reset_Handler
|
||||||
.weak Reset_Handler
|
.weak Reset_Handler
|
||||||
.type Reset_Handler, %function
|
.type Reset_Handler, %function
|
||||||
Reset_Handler:
|
Reset_Handler:
|
||||||
|
ldr sp, =_estack /* set stack pointer */
|
||||||
|
|
||||||
/* Copy the data segment initializers from flash to SRAM */
|
/* Copy the data segment initializers from flash to SRAM */
|
||||||
movs r1, #0
|
movs r1, #0
|
||||||
b LoopCopyDataInit
|
b LoopCopyDataInit
|
||||||
|
@ -105,21 +107,13 @@ LoopFillZerobss:
|
||||||
cmp r2, r3
|
cmp r2, r3
|
||||||
bcc FillZerobss
|
bcc FillZerobss
|
||||||
|
|
||||||
/*FPU settings*/
|
|
||||||
ldr r0, =0xE000ED88 /* Enable CP10,CP11 */
|
|
||||||
ldr r1,[r0]
|
|
||||||
orr r1,r1,#(0xF << 20)
|
|
||||||
str r1,[r0]
|
|
||||||
|
|
||||||
/* Call the clock system initialization function.*/
|
/* Call the clock system initialization function.*/
|
||||||
bl SystemInit
|
bl SystemInit
|
||||||
|
/* Call static constructors */
|
||||||
|
// bl __libc_init_array
|
||||||
/* Call the application's entry point.*/
|
/* Call the application's entry point.*/
|
||||||
bl main
|
bl main
|
||||||
bx lr
|
bx lr
|
||||||
|
|
||||||
LoopForever:
|
|
||||||
b LoopForever
|
|
||||||
|
|
||||||
.size Reset_Handler, .-Reset_Handler
|
.size Reset_Handler, .-Reset_Handler
|
||||||
|
|
||||||
/**
|
/**
|
||||||
|
@ -141,7 +135,7 @@ Infinite_Loop:
|
||||||
* 0x0000.0000.
|
* 0x0000.0000.
|
||||||
*
|
*
|
||||||
*******************************************************************************/
|
*******************************************************************************/
|
||||||
.section .isr_vector,"a",%progbits
|
.section .isr_vector,"a",%progbits
|
||||||
.type g_pfnVectors, %object
|
.type g_pfnVectors, %object
|
||||||
.size g_pfnVectors, .-g_pfnVectors
|
.size g_pfnVectors, .-g_pfnVectors
|
||||||
|
|
||||||
|
@ -149,6 +143,7 @@ Infinite_Loop:
|
||||||
g_pfnVectors:
|
g_pfnVectors:
|
||||||
.word _estack
|
.word _estack
|
||||||
.word Reset_Handler
|
.word Reset_Handler
|
||||||
|
|
||||||
.word NMI_Handler
|
.word NMI_Handler
|
||||||
.word HardFault_Handler
|
.word HardFault_Handler
|
||||||
.word MemManage_Handler
|
.word MemManage_Handler
|
||||||
|
@ -481,6 +476,9 @@ g_pfnVectors:
|
||||||
.weak DMA2_Stream4_IRQHandler
|
.weak DMA2_Stream4_IRQHandler
|
||||||
.thumb_set DMA2_Stream4_IRQHandler,Default_Handler
|
.thumb_set DMA2_Stream4_IRQHandler,Default_Handler
|
||||||
|
|
||||||
|
.weak DMA2_Stream4_IRQHandler
|
||||||
|
.thumb_set DMA2_Stream4_IRQHandler,Default_Handler
|
||||||
|
|
||||||
.weak ETH_IRQHandler
|
.weak ETH_IRQHandler
|
||||||
.thumb_set ETH_IRQHandler,Default_Handler
|
.thumb_set ETH_IRQHandler,Default_Handler
|
||||||
|
|
||||||
|
|
|
@ -2,9 +2,9 @@
|
||||||
******************************************************************************
|
******************************************************************************
|
||||||
* @file startup_stm32f746xx.s
|
* @file startup_stm32f746xx.s
|
||||||
* @author MCD Application Team
|
* @author MCD Application Team
|
||||||
* @version V1.1.0
|
* @version V1.2.0
|
||||||
* @date 22-April-2016
|
* @date 30-December-2016
|
||||||
* @brief STM32F746xx Devices vector table for GCC toolchain based application.
|
* @brief STM32F746xx Devices vector table for GCC based toolchain.
|
||||||
* This module performs:
|
* This module performs:
|
||||||
* - Set the initial SP
|
* - Set the initial SP
|
||||||
* - Set the initial PC == Reset_Handler,
|
* - Set the initial PC == Reset_Handler,
|
||||||
|
@ -73,10 +73,12 @@ defined in linker script */
|
||||||
* @retval : None
|
* @retval : None
|
||||||
*/
|
*/
|
||||||
|
|
||||||
.section .text.Reset_Handler
|
.section .text.Reset_Handler
|
||||||
.weak Reset_Handler
|
.weak Reset_Handler
|
||||||
.type Reset_Handler, %function
|
.type Reset_Handler, %function
|
||||||
Reset_Handler:
|
Reset_Handler:
|
||||||
|
ldr sp, =_estack /* set stack pointer */
|
||||||
|
|
||||||
/* Copy the data segment initializers from flash to SRAM */
|
/* Copy the data segment initializers from flash to SRAM */
|
||||||
movs r1, #0
|
movs r1, #0
|
||||||
b LoopCopyDataInit
|
b LoopCopyDataInit
|
||||||
|
@ -105,21 +107,13 @@ LoopFillZerobss:
|
||||||
cmp r2, r3
|
cmp r2, r3
|
||||||
bcc FillZerobss
|
bcc FillZerobss
|
||||||
|
|
||||||
/*FPU settings*/
|
|
||||||
ldr r0, =0xE000ED88 /* Enable CP10,CP11 */
|
|
||||||
ldr r1,[r0]
|
|
||||||
orr r1,r1,#(0xF << 20)
|
|
||||||
str r1,[r0]
|
|
||||||
|
|
||||||
/* Call the clock system initialization function.*/
|
/* Call the clock system initialization function.*/
|
||||||
bl SystemInit
|
bl SystemInit
|
||||||
|
/* Call static constructors */
|
||||||
|
// bl __libc_init_array
|
||||||
/* Call the application's entry point.*/
|
/* Call the application's entry point.*/
|
||||||
bl main
|
bl main
|
||||||
bx lr
|
bx lr
|
||||||
|
|
||||||
LoopForever:
|
|
||||||
b LoopForever
|
|
||||||
|
|
||||||
.size Reset_Handler, .-Reset_Handler
|
.size Reset_Handler, .-Reset_Handler
|
||||||
|
|
||||||
/**
|
/**
|
||||||
|
@ -141,7 +135,7 @@ Infinite_Loop:
|
||||||
* 0x0000.0000.
|
* 0x0000.0000.
|
||||||
*
|
*
|
||||||
*******************************************************************************/
|
*******************************************************************************/
|
||||||
.section .isr_vector,"a",%progbits
|
.section .isr_vector,"a",%progbits
|
||||||
.type g_pfnVectors, %object
|
.type g_pfnVectors, %object
|
||||||
.size g_pfnVectors, .-g_pfnVectors
|
.size g_pfnVectors, .-g_pfnVectors
|
||||||
|
|
||||||
|
@ -149,6 +143,7 @@ Infinite_Loop:
|
||||||
g_pfnVectors:
|
g_pfnVectors:
|
||||||
.word _estack
|
.word _estack
|
||||||
.word Reset_Handler
|
.word Reset_Handler
|
||||||
|
|
||||||
.word NMI_Handler
|
.word NMI_Handler
|
||||||
.word HardFault_Handler
|
.word HardFault_Handler
|
||||||
.word MemManage_Handler
|
.word MemManage_Handler
|
||||||
|
@ -250,12 +245,12 @@ g_pfnVectors:
|
||||||
.word UART7_IRQHandler /* UART7 */
|
.word UART7_IRQHandler /* UART7 */
|
||||||
.word UART8_IRQHandler /* UART8 */
|
.word UART8_IRQHandler /* UART8 */
|
||||||
.word SPI4_IRQHandler /* SPI4 */
|
.word SPI4_IRQHandler /* SPI4 */
|
||||||
.word SPI5_IRQHandler /* SPI5 */
|
.word SPI5_IRQHandler /* SPI5 */
|
||||||
.word SPI6_IRQHandler /* SPI6 */
|
.word SPI6_IRQHandler /* SPI6 */
|
||||||
.word SAI1_IRQHandler /* SAI1 */
|
.word SAI1_IRQHandler /* SAI1 */
|
||||||
.word LTDC_IRQHandler /* LTDC */
|
.word LTDC_IRQHandler /* LTDC */
|
||||||
.word LTDC_ER_IRQHandler /* LTDC_ER */
|
.word LTDC_ER_IRQHandler /* LTDC error */
|
||||||
.word DMA2D_IRQHandler /* DMA2D */
|
.word DMA2D_IRQHandler /* DMA2D */
|
||||||
.word SAI2_IRQHandler /* SAI2 */
|
.word SAI2_IRQHandler /* SAI2 */
|
||||||
.word QUADSPI_IRQHandler /* QUADSPI */
|
.word QUADSPI_IRQHandler /* QUADSPI */
|
||||||
.word LPTIM1_IRQHandler /* LPTIM1 */
|
.word LPTIM1_IRQHandler /* LPTIM1 */
|
||||||
|
@ -481,6 +476,9 @@ g_pfnVectors:
|
||||||
.weak DMA2_Stream4_IRQHandler
|
.weak DMA2_Stream4_IRQHandler
|
||||||
.thumb_set DMA2_Stream4_IRQHandler,Default_Handler
|
.thumb_set DMA2_Stream4_IRQHandler,Default_Handler
|
||||||
|
|
||||||
|
.weak DMA2_Stream4_IRQHandler
|
||||||
|
.thumb_set DMA2_Stream4_IRQHandler,Default_Handler
|
||||||
|
|
||||||
.weak ETH_IRQHandler
|
.weak ETH_IRQHandler
|
||||||
.thumb_set ETH_IRQHandler,Default_Handler
|
.thumb_set ETH_IRQHandler,Default_Handler
|
||||||
|
|
||||||
|
|
Loading…
Reference in New Issue