本文整理汇总了C++中CLOCK_EnableClock函数的典型用法代码示例。如果您正苦于以下问题:C++ CLOCK_EnableClock函数的具体用法?C++ CLOCK_EnableClock怎么用?C++ CLOCK_EnableClock使用的例子?那么恭喜您, 这里精选的函数代码示例或许可以为您提供帮助。
在下文中一共展示了CLOCK_EnableClock函数的20个代码示例,这些例子默认根据受欢迎程度排序。您可以为喜欢或者感觉有用的代码点赞,您的评价将有助于我们的系统推荐出更棒的C++代码示例。
示例1: BOARD_InitPins
/*!
* @brief Initialize all pins used in this example
*
* @param disablePortClockAfterInit disable port clock after pin
* initialization or not.
*/
void BOARD_InitPins(void)
{
/* Initialize UART1 pins below */
/* Ungate the port clock */
/* Enable the clock to the PORT module that the LED is on. */
CLOCK_EnableClock(kCLOCK_PortE);
CLOCK_EnableClock(kCLOCK_PortB);
/* SET USB pins */
/* Affects PORTB_PCR16 register */
PORT_SetPinMux(PORTB, 16u, kPORT_MuxAlt3);
/* Affects PORTB_PCR17 register */
PORT_SetPinMux(PORTB, 17u, kPORT_MuxAlt3);
/* Led pin mux Configuration */
PORT_SetPinMux(PORTB, 22U, kPORT_MuxAsGpio);
PORT_SetPinMux(PORTE, 26U, kPORT_MuxAsGpio);
PORT_SetPinMux(PORTB, 21U, kPORT_MuxAsGpio);
//debug
PORT_SetPinMux(PORTE, 24U, kPORT_MuxAsGpio);
/* Initialize LED pins below */
LED_RED_INIT(1U);
LED_GREEN_INIT(1U);
LED_BLUE_INIT(1U);
}
开发者ID:opprud,项目名称:kinteis,代码行数:36,代码来源:pin_mux.c
示例2: BOARD_InitPins
void BOARD_InitPins(void)
{
/* Declare and initialise for pull up configuration */
port_pin_config_t pinConfig = {0};
pinConfig.pullSelect = kPORT_PullUp;
#if defined(FSL_FEATURE_PORT_HAS_OPEN_DRAIN) && FSL_FEATURE_PORT_HAS_OPEN_DRAIN
pinConfig.openDrainEnable = kPORT_OpenDrainEnable;
#endif /* FSL_FEATURE_PORT_HAS_OPEN_DRAIN */
/* Initialize LPUART0 pins below */
/* Ungate the port clock */
CLOCK_EnableClock(kCLOCK_PortA);
/* Affects PORTA_PCR1 register */
PORT_SetPinMux(PORTA, 1u, kPORT_MuxAlt2);
/* Affects PORTA_PCR2 register */
PORT_SetPinMux(PORTA, 2u, kPORT_MuxAlt2);
/* Ungate the port clock */
CLOCK_EnableClock(kCLOCK_PortB);
/* I2C0 pull up resistor setting */
PORT_SetPinConfig(PORTB, 2U, &pinConfig);
PORT_SetPinConfig(PORTB, 3U, &pinConfig);
/* I2C0 PIN_MUX Configuration */
PORT_SetPinMux(PORTB, 2U, kPORT_MuxAlt2);
PORT_SetPinMux(PORTB, 3U, kPORT_MuxAlt2);
/* Ungate the port clock */
CLOCK_EnableClock(kCLOCK_PortE);
/* I2C1 pull up resistor setting */
PORT_SetPinConfig(PORTE, 0U, &pinConfig);
PORT_SetPinConfig(PORTE, 1U, &pinConfig);
/* I2C1 PIN_MUX Configuration */
PORT_SetPinMux(PORTE, 0U, kPORT_MuxAlt6);
PORT_SetPinMux(PORTE, 1U, kPORT_MuxAlt6);
}
开发者ID:francisconroy,项目名称:affenspinner,代码行数:35,代码来源:pin_mux.c
示例3: BOARD_InitPins
/*******************************************************************************
* Code
******************************************************************************/
void BOARD_InitPins(void)
{
/* Declare and initialise for pull up configuration */
port_pin_config_t pinConfig = {0};
pinConfig.pullSelect = kPORT_PullUp;
pinConfig.openDrainEnable = kPORT_OpenDrainEnable;
/* Initialize UART1 pins below */
/* Ungate the port clock */
CLOCK_EnableClock(kCLOCK_PortE);
/* Affects PORTE_PCR0 register */
PORT_SetPinMux(PORTE, 0U, kPORT_MuxAlt3);
/* Affects PORTE_PCR1 register */
PORT_SetPinMux(PORTE, 1U, kPORT_MuxAlt3);
/* Ungate the port clock */
CLOCK_EnableClock(kCLOCK_PortB);
/* I2C0 pull up resistor setting */
PORT_SetPinConfig(PORTB, 2U, &pinConfig);
PORT_SetPinConfig(PORTB, 3U, &pinConfig);
/* I2C0 PIN_MUX Configuration */
PORT_SetPinMux(PORTB, 2U, kPORT_MuxAlt2);
PORT_SetPinMux(PORTB, 3U, kPORT_MuxAlt2);
/* Ungate the port clock */
CLOCK_EnableClock(kCLOCK_PortC);
/* I2C1 pull up resistor setting */
PORT_SetPinConfig(PORTC, 10U, &pinConfig);
PORT_SetPinConfig(PORTC, 11U, &pinConfig);
/* I2C1 PIN_MUX Configuration */
PORT_SetPinMux(PORTC, 10U, kPORT_MuxAlt2);
PORT_SetPinMux(PORTC, 11U, kPORT_MuxAlt2);
}
开发者ID:UHK-Fork,项目名称:KSDK_2.0_FRDM-K22F,代码行数:36,代码来源:pin_mux.c
示例4: BOARD_InitPins
void BOARD_InitPins(void)
{
port_pin_config_t config = {0};
/* Initialize UART1 pins below */
/* Ungate the port clock */
CLOCK_EnableClock(kCLOCK_PortE);
/* Affects PORTE_PCR0 register */
PORT_SetPinMux(PORTE, 0U, kPORT_MuxAlt3);
/* Affects PORTE_PCR1 register */
PORT_SetPinMux(PORTE, 1U, kPORT_MuxAlt3);
CLOCK_EnableClock(kCLOCK_PortB);
CLOCK_EnableClock(kCLOCK_PortC);
/* Sets PORTC_PCR3 as SPI_PCS */
config.mux = kPORT_MuxAlt2;
PORT_SetPinConfig(PORTB, 10U, &config);
/* Sets PORTC_PCR5 as SPI_SCK. */
PORT_SetPinConfig(PORTB, 11U, &config);
/* Sets PORTD_PCR3 as SPI_MISO */
PORT_SetPinConfig(PORTB, 16U, &config);
/* Sets PORTD_PCR2 as SPI_MOSI */
PORT_SetPinConfig(PORTB, 17U, &config);
/* Sets card detection pin as GPIO */
config.pullSelect = kPORT_PullUp;
config.mux = kPORT_MuxAsGpio;
PORT_SetPinConfig(PORTE, 6U, &config);
}
开发者ID:UltimateHackingKeyboard,项目名称:KSDK_2.0_MK22FN512xxx12,代码行数:34,代码来源:pin_mux.c
示例5: SECTION
SECTION("itcm") int rt_hw_flexspi_init(void)
{
flexspi_config_t config;
status_t status;
rt_uint32_t level;
level = rt_hw_interrupt_disable();
// Set flexspi root clock to 166MHZ.
const clock_usb_pll_config_t g_ccmConfigUsbPll = {.loopDivider = 0U};
CLOCK_InitUsb1Pll(&g_ccmConfigUsbPll);
CLOCK_InitUsb1Pfd(kCLOCK_Pfd0, 26); /* Set PLL3 PFD0 clock 332MHZ. */
CLOCK_SetMux(kCLOCK_FlexspiMux, 0x3); /* Choose PLL3 PFD0 clock as flexspi source clock. */
CLOCK_SetDiv(kCLOCK_FlexspiDiv, 3); /* flexspi clock 83M, DDR mode, internal clock 42M. */
/*Get FLEXSPI default settings and configure the flexspi. */
FLEXSPI_GetDefaultConfig(&config);
/*Set AHB buffer size for reading data through AHB bus. */
config.ahbConfig.enableAHBPrefetch = true;
/*Allow AHB read start address do not follow the alignment requirement. */
config.ahbConfig.enableReadAddressOpt = true;
/* enable diff clock and DQS */
config.enableSckBDiffOpt = true;
config.rxSampleClock = kFLEXSPI_ReadSampleClkExternalInputFromDqsPad;
config.enableCombination = true;
FLEXSPI_Init(FLEXSPI, &config);
/* Configure flash settings according to serial flash feature. */
FLEXSPI_SetFlashConfig(FLEXSPI, &deviceconfig, kFLEXSPI_PortA1);
/* Update LUT table. */
FLEXSPI_UpdateLUT(FLEXSPI, 0, customLUT, CUSTOM_LUT_LENGTH);
/* Do software reset. */
FLEXSPI_SoftwareReset(FLEXSPI);
status = flexspi_nor_hyperflash_cfi(FLEXSPI);
/* Get vendor ID. */
if (status != kStatus_Success)
{
FLEXSPI_Enable(FLEXSPI, false);
CLOCK_DisableClock(FLEXSPI_CLOCK);
CLOCK_SetDiv(kCLOCK_FlexspiDiv, 0); /* flexspi clock 332M, DDR mode, internal clock 166M. */
CLOCK_EnableClock(FLEXSPI_CLOCK);
FLEXSPI_Enable(FLEXSPI, true);
FLEXSPI_SoftwareReset(FLEXSPI);
rt_hw_interrupt_enable(level);
return status;
}
FLEXSPI_Enable(FLEXSPI, false);
CLOCK_DisableClock(FLEXSPI_CLOCK);
CLOCK_SetDiv(kCLOCK_FlexspiDiv, 0); /* flexspi clock 332M, DDR mode, internal clock 166M. */
CLOCK_EnableClock(FLEXSPI_CLOCK);
FLEXSPI_Enable(FLEXSPI, true);
FLEXSPI_SoftwareReset(FLEXSPI);
rt_hw_interrupt_enable(level);
return 0;
}
开发者ID:geniusgogo,项目名称:rt-thread,代码行数:60,代码来源:drv_flexspi_hyper.c
示例6: LPTMR_Init
/*!
* brief Ungates the LPTMR clock and configures the peripheral for a basic operation.
*
* note This API should be called at the beginning of the application using the LPTMR driver.
*
* param base LPTMR peripheral base address
* param config A pointer to the LPTMR configuration structure.
*/
void LPTMR_Init(LPTMR_Type *base, const lptmr_config_t *config)
{
assert(config);
#if defined(LPTMR_CLOCKS)
#if !(defined(FSL_SDK_DISABLE_DRIVER_CLOCK_CONTROL) && FSL_SDK_DISABLE_DRIVER_CLOCK_CONTROL)
uint32_t instance = LPTMR_GetInstance(base);
/* Ungate the LPTMR clock*/
CLOCK_EnableClock(s_lptmrClocks[instance]);
#if defined(LPTMR_PERIPH_CLOCKS)
CLOCK_EnableClock(s_lptmrPeriphClocks[instance]);
#endif
#endif /* FSL_SDK_DISABLE_DRIVER_CLOCK_CONTROL */
#endif /* LPTMR_CLOCKS */
/* Configure the timers operation mode and input pin setup */
base->CSR = (LPTMR_CSR_TMS(config->timerMode) | LPTMR_CSR_TFC(config->enableFreeRunning) |
LPTMR_CSR_TPP(config->pinPolarity) | LPTMR_CSR_TPS(config->pinSelect));
/* Configure the prescale value and clock source */
base->PSR = (LPTMR_PSR_PRESCALE(config->value) | LPTMR_PSR_PBYP(config->bypassPrescaler) |
LPTMR_PSR_PCS(config->prescalerClockSource));
}
开发者ID:loicpoulain,项目名称:zephyr,代码行数:34,代码来源:fsl_lptmr.c
示例7: PlatformInit
void PlatformInit(int argc, char *argv[])
{
uint32_t temp, tempTrim;
uint8_t revId;
/* enable clock for PORTs */
CLOCK_EnableClock(kCLOCK_PortA);
CLOCK_EnableClock(kCLOCK_PortB);
CLOCK_EnableClock(kCLOCK_PortC);
SIM->SCGC6 |= (SIM_SCGC6_DMAMUX_MASK); /* Enable clock to DMA_MUX (SIM module) */
SIM->SCGC7 |= (SIM_SCGC7_DMA_MASK);
/* Obtain REV ID from SIM */
revId = (uint8_t)((SIM->SDID & SIM_SDID_REVID_MASK) >> SIM_SDID_REVID_SHIFT);
if (revId == 0)
{
tempTrim = RSIM->ANA_TRIM;
RSIM->ANA_TRIM |= RSIM_ANA_TRIM_BB_LDO_XO_TRIM_MASK; /* max trim for BB LDO for XO */
}
/* Turn on clocks for the XCVR */
/* Enable RF OSC in RSIM and wait for ready */
temp = RSIM->CONTROL;
temp &= ~RSIM_CONTROL_RF_OSC_EN_MASK;
RSIM->CONTROL = temp | RSIM_CONTROL_RF_OSC_EN(1);
/* Prevent XTAL_OUT_EN from generating XTAL_OUT request */
RSIM->RF_OSC_CTRL |= RSIM_RF_OSC_CTRL_RADIO_EXT_OSC_OVRD_EN_MASK;
/* wait for RF_OSC_READY */
while ((RSIM->CONTROL & RSIM_CONTROL_RF_OSC_READY_MASK) == 0)
{
}
if (revId == 0)
{
SIM->SCGC5 |= SIM_SCGC5_PHYDIG_MASK;
XCVR_TSM->OVRD0 |= XCVR_TSM_OVRD0_BB_LDO_ADCDAC_EN_OVRD_EN_MASK |
XCVR_TSM_OVRD0_BB_LDO_ADCDAC_EN_OVRD_MASK; /* Force ADC DAC LDO on to prevent BGAP failure */
/* Reset LDO trim settings */
RSIM->ANA_TRIM = tempTrim;
} /* Workaround for Rev 1.0 XTAL startup and ADC analog diagnostics circuitry */
/* Init board clock */
BOARD_BootClockRUN();
kw41zAlarmInit();
kw41zRandomInit();
kw41zRadioInit();
otPlatUartEnable();
(void)argc;
(void)argv;
}
开发者ID:itavero,项目名称:openthread,代码行数:56,代码来源:platform.c
示例8: INPUTMUX_Init
void INPUTMUX_Init(INPUTMUX_Type *base)
{
#if !(defined(FSL_SDK_DISABLE_DRIVER_CLOCK_CONTROL) && FSL_SDK_DISABLE_DRIVER_CLOCK_CONTROL)
#if defined(FSL_FEATURE_INPUTMUX_HAS_NO_INPUTMUX_CLOCK_SOURCE) && FSL_FEATURE_INPUTMUX_HAS_NO_INPUTMUX_CLOCK_SOURCE
CLOCK_EnableClock(kCLOCK_Sct);
CLOCK_EnableClock(kCLOCK_Dma);
#else
CLOCK_EnableClock(kCLOCK_InputMux);
#endif /* FSL_FEATURE_INPUTMUX_HAS_NO_INPUTMUX_CLOCK_SOURCE */
#endif /* FSL_SDK_DISABLE_DRIVER_CLOCK_CONTROL */
}
开发者ID:heyuanjie87,项目名称:rt-thread,代码行数:11,代码来源:fsl_inputmux.c
示例9: RNGA_Init
void RNGA_Init(RNG_Type *base)
{
/* Enable the clock gate. */
CLOCK_EnableClock(kCLOCK_Rnga0);
CLOCK_DisableClock(kCLOCK_Rnga0); /* To solve the release version on twrkm43z75m */
CLOCK_EnableClock(kCLOCK_Rnga0);
/* Reset the registers for RNGA module to reset state. */
RNG_WR_CR(base, 0);
/* Enables the RNGA random data generation and loading.*/
RNG_WR_CR_GO(base, 1);
}
开发者ID:AdarshJayakumar,项目名称:mcuoneclipse,代码行数:12,代码来源:fsl_rnga.c
示例10: BOARD_InitPins
void BOARD_InitPins(void)
{
/* Set EXTAL0/XTAL0 pinmux. */
CLOCK_EnableClock(kCLOCK_PortA);
PORT_SetPinMux(PORTA, 18U, kPORT_PinDisabledOrAnalog);
PORT_SetPinMux(PORTA, 19U, kPORT_PinDisabledOrAnalog);
/* Enable LED port clock */
CLOCK_EnableClock(kCLOCK_PortA);
/* Led pin mux Configuration */
PORT_SetPinMux(PORTA, 13U, kPORT_MuxAsGpio);
}
开发者ID:Wangwenxue,项目名称:MKL43_33,代码行数:12,代码来源:pin_mux.c
示例11: BOARD_InitPins
/*!
* @brief Initialize all pins used in this example
*/
void BOARD_InitPins(void)
{
/* Ungate the port clock */
CLOCK_EnableClock(kCLOCK_PortE);
/* Affects PORTE_PCR0 register */
PORT_SetPinMux(PORTE, 0U, kPORT_MuxAlt3);
/* Affects PORTE_PCR1 register */
PORT_SetPinMux(PORTE, 1U, kPORT_MuxAlt3);
CLOCK_EnableClock(kCLOCK_PortB);
PORT_SetPinMux(PORTB, 0U, kPORT_PinDisabledOrAnalog);
}
开发者ID:UltimateHackingKeyboard,项目名称:KSDK_2.0_MK22FN512xxx12,代码行数:16,代码来源:pin_mux.c
示例12: modem_init
void modem_init() {
const gpio_pin_config_t OUTTRUE = {kGPIO_DigitalOutput, true};
const gpio_pin_config_t IN = {kGPIO_DigitalInput, false};
// initialize BOARD_CELL pins
CLOCK_EnableClock(BOARD_CELL_UART_PORT_CLOCK);
PORT_SetPinMux(BOARD_CELL_UART_PORT, BOARD_CELL_UART_TX_PIN, BOARD_CELL_UART_TX_ALT);
PORT_SetPinMux(BOARD_CELL_UART_PORT, BOARD_CELL_UART_RX_PIN, BOARD_CELL_UART_RX_ALT);
CLOCK_EnableClock(BOARD_CELL_PIN_PORT_CLOCK);
PORT_SetPinMux(BOARD_CELL_PIN_PORT, BOARD_CELL_STATUS_PIN, kPORT_MuxAsGpio);
GPIO_PinInit(BOARD_CELL_PIN_GPIO, BOARD_CELL_STATUS_PIN, &IN);
#if BOARD_CELL_RESET_PIN
PORT_SetPinMux(BOARD_CELL_PIN_PORT, BOARD_CELL_RESET_PIN, kPORT_MuxAsGpio);
GPIO_PinInit(BOARD_CELL_PIN_GPIO, BOARD_CELL_RESET_PIN, &OUTTRUE);
#endif
PORT_SetPinMux(BOARD_CELL_PIN_PORT, BOARD_CELL_PWRKEY_PIN, kPORT_MuxAsGpio);
GPIO_PinInit(BOARD_CELL_PIN_GPIO, BOARD_CELL_PWRKEY_PIN, &OUTTRUE);
// the ring identifier is optional, only use if a pin and port exists
#if BOARD_CELL_RI_PIN
PORT_SetPinMux(BOARD_CELL_PIN_PORT, BOARD_CELL_RI_PIN, kPORT_MuxAsGpio);
GPIO_PinInit(BOARD_CELL_PIN_GPIO, BOARD_CELL_RI_PIN, &IN);
#endif
#if BOARD_CELL_PWR_DOMAIN
const gpio_pin_config_t OUTFALSE = {kGPIO_DigitalOutput, false};
CLOCK_EnableClock(BOARD_CELL_PWR_EN_CLOCK);
PORT_SetPinMux(BOARD_CELL_PWR_EN_PORT, BOARD_CELL_PWR_EN_PIN, kPORT_MuxAsGpio);
GPIO_PinInit(BOARD_CELL_PWR_EN_GPIO, BOARD_CELL_PWR_EN_PIN, &OUTFALSE);
#endif
// configure uart driver connected to the SIM800H
lpuart_config_t lpuart_config;
LPUART_GetDefaultConfig(&lpuart_config);
lpuart_config.baudRate_Bps = 115200;
lpuart_config.parityMode = kLPUART_ParityDisabled;
lpuart_config.stopBitCount = kLPUART_OneStopBit;
LPUART_Init(BOARD_CELL_UART, &lpuart_config, BOARD_CELL_PORT_CLOCK_FREQ);
LPUART_EnableRx(BOARD_CELL_UART, true);
LPUART_EnableTx(BOARD_CELL_UART, true);
LPUART_EnableInterrupts(BOARD_CELL_UART, kLPUART_RxDataRegFullInterruptEnable);
EnableIRQ(BOARD_CELL_UART_IRQ);
}
开发者ID:ubirch,项目名称:ubirch-board-firmware,代码行数:49,代码来源:sim800h_core.c
示例13: BOARD_InitPins
void BOARD_InitPins(void)
{
/* Initialize LPUART0 pins below */
/* Ungate the port clock */
CLOCK_EnableClock(kCLOCK_PortA);
/* Affects PORTA_PCR1 register */
PORT_SetPinMux(PORTA, 1U, kPORT_MuxAlt2);
/* Affects PORTA_PCR2 register */
PORT_SetPinMux(PORTA, 2U, kPORT_MuxAlt2);
/* Ungate the port clock */
CLOCK_EnableClock(kCLOCK_PortE);
/* PTE31 TPM0 channel 4 -- GREEN LED */
PORT_SetPinMux(PORTE, 31U, kPORT_MuxAlt3);
}
开发者ID:francisconroy,项目名称:affenspinner,代码行数:15,代码来源:pin_mux.c
示例14: initialize_enet_hardware
/*******************************************************************************
* Code
******************************************************************************/
void initialize_enet_hardware(void)
{
port_pin_config_t configENET = {0};
/* Disable MPU. */
MPU->CESR &= ~MPU_CESR_VLD_MASK;
CLOCK_EnableClock(kCLOCK_PortC);
CLOCK_EnableClock(kCLOCK_PortB);
/* Affects PORTC_PCR16 register */
PORT_SetPinMux(PORTC, 16u, kPORT_MuxAlt4);
/* Affects PORTC_PCR17 register */
PORT_SetPinMux(PORTC, 17u, kPORT_MuxAlt4);
/* Affects PORTC_PCR18 register */
PORT_SetPinMux(PORTC, 18u, kPORT_MuxAlt4);
/* Affects PORTC_PCR19 register */
PORT_SetPinMux(PORTC, 19u, kPORT_MuxAlt4);
/* Affects PORTB_PCR1 register */
PORT_SetPinMux(PORTB, 1u, kPORT_MuxAlt4);
configENET.openDrainEnable = kPORT_OpenDrainEnable;
configENET.mux = kPORT_MuxAlt4;
configENET.pullSelect = kPORT_PullUp;
/* Ungate the port clock */
CLOCK_EnableClock(kCLOCK_PortA);
/* Affects PORTB_PCR0 register */
PORT_SetPinConfig(PORTB, 0u, &configENET);
/* Affects PORTA_PCR13 register */
PORT_SetPinMux(PORTA, 13u, kPORT_MuxAlt4);
/* Affects PORTA_PCR12 register */
PORT_SetPinMux(PORTA, 12u, kPORT_MuxAlt4);
/* Affects PORTA_PCR14 register */
PORT_SetPinMux(PORTA, 14u, kPORT_MuxAlt4);
/* Affects PORTA_PCR5 register */
PORT_SetPinMux(PORTA, 5u, kPORT_MuxAlt4);
/* Affects PORTA_PCR16 register */
PORT_SetPinMux(PORTA, 16u, kPORT_MuxAlt4);
/* Affects PORTA_PCR17 register */
PORT_SetPinMux(PORTA, 17u, kPORT_MuxAlt4);
/* Affects PORTA_PCR15 register */
PORT_SetPinMux(PORTA, 15u, kPORT_MuxAlt4);
/* Affects PORTA_PCR28 register */
PORT_SetPinMux(PORTA, 28u, kPORT_MuxAlt4);
/* Select the Ethernet timestamp clock source */
CLOCK_SetEnetTime0Clock(0x2);
}
开发者ID:ARMmbed,项目名称:sal-nanostack-driver-k64f-eth,代码行数:51,代码来源:hardware_init.c
示例15: KPP_Init
void KPP_Init(KPP_Type *base, kpp_config_t *configure)
{
assert(configure);
uint32_t instance = KPP_GetInstance(base);
#if !(defined(FSL_SDK_DISABLE_DRIVER_CLOCK_CONTROL) && FSL_SDK_DISABLE_DRIVER_CLOCK_CONTROL)
/* Un-gate sdram controller clock. */
CLOCK_EnableClock(s_kppClock[KPP_GetInstance(base)]);
#endif /* FSL_SDK_DISABLE_DRIVER_CLOCK_CONTROL */
/* Clear all. */
base->KPSR &= ~(KPP_KPSR_KRIE_MASK | KPP_KPSR_KDIE_MASK);
/* Enable the keypad row and set the column strobe output to open drain. */
base->KPCR = KPP_KPCR_KRE(configure->activeRow);
base->KPDR = KPP_KPDR_KCD((uint8_t)~(configure->activeColumn));
base->KPCR |= KPP_KPCR_KCO(configure->activeColumn);
/* Set the input direction for row and output direction for column. */
base->KDDR = KPP_KDDR_KCDD(configure->activeColumn) | KPP_KDDR_KRDD((uint8_t)~(configure->activeRow));
/* Clear the status flag and enable the interrupt. */
base->KPSR =
KPP_KPSR_KPKR_MASK | KPP_KPSR_KPKD_MASK | KPP_KPSR_KDSC_MASK | configure->interrupt;
if (configure->interrupt)
{
/* Enable at the Interrupt */
EnableIRQ(s_kppIrqs[instance]);
}
}
开发者ID:Davidfind,项目名称:rt-thread,代码行数:32,代码来源:fsl_kpp.c
示例16: PXP_Init
/*!
* brief Initialize the PXP.
*
* This function enables the PXP peripheral clock, and resets the PXP registers
* to default status.
*
* param base PXP peripheral base address.
*/
void PXP_Init(PXP_Type *base)
{
uint32_t ctrl = 0U;
#if !(defined(FSL_SDK_DISABLE_DRIVER_CLOCK_CONTROL) && FSL_SDK_DISABLE_DRIVER_CLOCK_CONTROL)
uint32_t instance = PXP_GetInstance(base);
CLOCK_EnableClock(s_pxpClocks[instance]);
#endif
PXP_Reset(base);
/* Enable the process engine in primary processing flow. */
#if defined(PXP_CTRL_ENABLE_ROTATE0_MASK)
ctrl |= PXP_CTRL_ENABLE_ROTATE0_MASK;
#endif
#if defined(PXP_CTRL_ENABLE_ROTATE1_MASK)
ctrl |= PXP_CTRL_ENABLE_ROTATE1_MASK;
#endif
#if defined(PXP_CTRL_ENABLE_CSC2_MASK)
ctrl |= PXP_CTRL_ENABLE_CSC2_MASK;
#endif
#if defined(PXP_CTRL_ENABLE_LUT_MASK)
ctrl |= PXP_CTRL_ENABLE_LUT_MASK;
#endif
#if defined(PXP_CTRL_ENABLE_PS_AS_OUT_MASK)
ctrl |= PXP_CTRL_ENABLE_PS_AS_OUT_MASK;
#endif
base->CTRL = ctrl;
}
开发者ID:loicpoulain,项目名称:zephyr,代码行数:37,代码来源:fsl_pxp.c
示例17: BOARD_InitPins
/*FUNCTION**********************************************************************
*
* Function Name : BOARD_InitPins
* Description : Configures pin routing and optionally pin electrical features.
*
*END**************************************************************************/
void BOARD_InitPins(void) { /* Function assigned for the Cortex-M0P */
CLOCK_EnableClock(kCLOCK_Iocon); /* Enables the clock for the IOCON block. 0 = Disable; 1 = Enable.: 0x01u */
const uint32_t port0_pin0_config = (
IOCON_PIO_FUNC1 | /* Pin is configured as FC0_RXD_SDA_MOSI */
IOCON_PIO_MODE_INACT | /* No addition pin function */
IOCON_PIO_INV_DI | /* Input function is not inverted */
IOCON_PIO_DIGITAL_EN | /* Enables digital function */
IOCON_PIO_INPFILT_OFF | /* Input filter disabled */
IOCON_PIO_SLEW_STANDARD | /* Standard mode, output slew rate control is enabled */
IOCON_PIO_OPENDRAIN_DI /* Open drain is disabled */
);
IOCON_PinMuxSet(IOCON, PORT0_IDX, PIN0_IDX, port0_pin0_config); /* PORT0 PIN0 (coords: 31) is configured as FC0_RXD_SDA_MOSI */
const uint32_t port0_pin1_config = (
IOCON_PIO_FUNC1 | /* Pin is configured as FC0_TXD_SCL_MISO */
IOCON_PIO_MODE_INACT | /* No addition pin function */
IOCON_PIO_INV_DI | /* Input function is not inverted */
IOCON_PIO_DIGITAL_EN | /* Enables digital function */
IOCON_PIO_INPFILT_OFF | /* Input filter disabled */
IOCON_PIO_SLEW_STANDARD | /* Standard mode, output slew rate control is enabled */
IOCON_PIO_OPENDRAIN_DI /* Open drain is disabled */
);
IOCON_PinMuxSet(IOCON, PORT0_IDX, PIN1_IDX, port0_pin1_config); /* PORT0 PIN1 (coords: 32) is configured as FC0_TXD_SCL_MISO */
const uint32_t port0_pin15_config = (
IOCON_PIO_FUNC2 | /* Pin is configured as SWO */
IOCON_PIO_MODE_INACT | /* No addition pin function */
IOCON_PIO_INV_DI | /* Input function is not inverted */
IOCON_PIO_DIGITAL_EN | /* Enables digital function */
IOCON_PIO_INPFILT_OFF | /* Input filter disabled */
IOCON_PIO_SLEW_STANDARD | /* Standard mode, output slew rate control is enabled */
IOCON_PIO_OPENDRAIN_DI /* Open drain is disabled */
);
IOCON_PinMuxSet(IOCON, PORT0_IDX, PIN15_IDX, port0_pin15_config); /* PORT0 PIN15 (coords: 50) is configured as SWO */
}
开发者ID:wosayttn,项目名称:aos,代码行数:40,代码来源:pin_mux.c
示例18: _touch
static void _touch(void *p)
{
int io_s;
gpio_pin_config_t pin_config =
{
kGPIO_DigitalInput, 0,
};
CLOCK_EnableClock(kCLOCK_Gpio4);
/* Enable touch panel controller */
GPIO_PinInit(GPIO, 4, 0, &pin_config);
while(1)
{
rt_thread_delay(RT_TICK_PER_SECOND / 60);
io_s = GPIO_ReadPinInput(GPIO, 4, 0);
if (io_s == 0)
{
_touch_session();
}
else
continue;
}
}
开发者ID:heyuanjie87,项目名称:rt-thread,代码行数:27,代码来源:drv_ft5406.c
示例19: CLOCK_EnableUsbfs0Clock
bool CLOCK_EnableUsbfs0Clock(clock_usb_src_t src, uint32_t freq)
{
bool ret = true;
CLOCK_DisableClock(kCLOCK_Usbfs0);
if (kCLOCK_UsbSrcExt == src)
{
SIM->SOPT2 &= ~SIM_SOPT2_USBSRC_MASK;
}
else
{
SIM->SOPT2 |= SIM_SOPT2_USBSRC_MASK;
}
CLOCK_EnableClock(kCLOCK_Usbfs0);
if (kCLOCK_UsbSrcIrc48M == src)
{
USB0->CLK_RECOVER_IRC_EN = 0x03U;
USB0->CLK_RECOVER_CTRL |= USB_CLK_RECOVER_CTRL_CLOCK_RECOVER_EN_MASK;
}
return ret;
}
开发者ID:visakhanc,项目名称:Kinetis_KL46,代码行数:25,代码来源:fsl_clock_kl46.c
示例20: DAC_Init
void DAC_Init(DAC_Type *base, const dac_config_t *config)
{
assert(NULL != config);
uint8_t tmp8;
/* Enable the clock. */
CLOCK_EnableClock(s_dacClocks[DAC_GetInstance(base)]);
/* Configure. */
/* DACx_C0. */
tmp8 = base->C0 & ~(DAC_C0_DACRFS_MASK | DAC_C0_LPEN_MASK);
if (kDAC_ReferenceVoltageSourceVref2 == config->referenceVoltageSource)
{
tmp8 |= DAC_C0_DACRFS_MASK;
}
if (config->enableLowPowerMode)
{
tmp8 |= DAC_C0_LPEN_MASK;
}
base->C0 = tmp8;
/* DAC_Enable(base, true); */
/* Tip: The DAC output can be enabled till then after user sets their own available data in application. */
}
开发者ID:Archcady,项目名称:mbed-os,代码行数:25,代码来源:fsl_dac.c
注:本文中的CLOCK_EnableClock函数示例整理自Github/MSDocs等源码及文档管理平台,相关代码片段筛选自各路编程大神贡献的开源项目,源码版权归原作者所有,传播和使用请参考对应项目的License;未经允许,请勿转载。 |
请发表评论