mirror of
https://github.com/betaflight/betaflight.git
synced 2025-07-15 04:15:44 +03:00
Implemented Camera Control using Hardware and Software PWM
This commit is contained in:
parent
491ecba4ed
commit
cc358dc405
21 changed files with 399 additions and 22 deletions
238
src/main/drivers/camera_control.c
Normal file
238
src/main/drivers/camera_control.c
Normal file
|
@ -0,0 +1,238 @@
|
|||
/*
|
||||
* This file is part of Cleanflight.
|
||||
*
|
||||
* Cleanflight is free software: you can redistribute it and/or modify
|
||||
* it under the terms of the GNU General Public License as published by
|
||||
* the Free Software Foundation, either version 3 of the License, or
|
||||
* (at your option) any later version.
|
||||
*
|
||||
* Cleanflight is distributed in the hope that it will be useful,
|
||||
* but WITHOUT ANY WARRANTY; without even the implied warranty of
|
||||
* MERCHANTABILITY or FITNESS FOR A PARTICULAR PURPOSE. See the
|
||||
* GNU General Public License for more details.
|
||||
*
|
||||
* You should have received a copy of the GNU General Public License
|
||||
* along with Cleanflight. If not, see <http://www.gnu.org/licenses/>.
|
||||
*/
|
||||
|
||||
#include <platform.h>
|
||||
|
||||
#ifdef USE_CAMERA_CONTROL
|
||||
|
||||
#include "camera_control.h"
|
||||
#include "io.h"
|
||||
#include "math.h"
|
||||
#include "nvic.h"
|
||||
#include "pwm_output.h"
|
||||
#include "time.h"
|
||||
#include "config/parameter_group_ids.h"
|
||||
|
||||
#if defined(STM32F40_41xxx)
|
||||
#define CAMERA_CONTROL_TIMER_MHZ 84
|
||||
#elif defined(STM32F7)
|
||||
#define CAMERA_CONTROL_TIMER_MHZ 108
|
||||
#else
|
||||
#define CAMERA_CONTROL_TIMER_MHZ 72
|
||||
#endif
|
||||
|
||||
#define CAMERA_CONTROL_PWM_RESOLUTION 128
|
||||
#define CAMERA_CONTROL_SOFT_PWM_RESOLUTION 448
|
||||
|
||||
#ifdef CURRENT_TARGET_CPU_VOLTAGE
|
||||
#define ADC_VOLTAGE CURRENT_TARGET_CPU_VOLTAGE
|
||||
#else
|
||||
#define ADC_VOLTAGE 3.3f
|
||||
#endif
|
||||
|
||||
#if !defined(STM32F411xE) && !defined(STM32F7)
|
||||
#define CAMERA_CONTROL_SOFTWARE_PWM_AVAILABLE
|
||||
#include "build/atomic.h"
|
||||
#endif
|
||||
|
||||
#define CAMERA_CONTROL_HARDWARE_PWM_AVAILABLE
|
||||
#include "timer.h"
|
||||
|
||||
|
||||
PG_REGISTER_WITH_RESET_TEMPLATE(cameraControlConfig_t, cameraControlConfig, PG_CAMERA_CONTROL_CONFIG, 0);
|
||||
|
||||
PG_RESET_TEMPLATE(cameraControlConfig_t, cameraControlConfig,
|
||||
.mode = CAMERA_CONTROL_MODE_HARDWARE_PWM,
|
||||
.refVoltage = 330,
|
||||
.keyDelayMs = 150,
|
||||
.ioTag = IO_TAG_NONE
|
||||
);
|
||||
|
||||
static struct {
|
||||
bool enabled;
|
||||
IO_t io;
|
||||
timerChannel_t channel;
|
||||
uint32_t period;
|
||||
} cameraControlRuntime;
|
||||
|
||||
static uint32_t endTimeMillis;
|
||||
|
||||
#ifdef CAMERA_CONTROL_SOFTWARE_PWM_AVAILABLE
|
||||
void TIM6_DAC_IRQHandler()
|
||||
{
|
||||
IOHi(cameraControlRuntime.io);
|
||||
|
||||
TIM6->SR = 0;
|
||||
}
|
||||
|
||||
void TIM7_IRQHandler()
|
||||
{
|
||||
IOLo(cameraControlRuntime.io);
|
||||
|
||||
TIM7->SR = 0;
|
||||
}
|
||||
#endif
|
||||
|
||||
void cameraControlInit()
|
||||
{
|
||||
if (cameraControlConfig()->ioTag == IO_TAG_NONE)
|
||||
return;
|
||||
|
||||
cameraControlRuntime.io = IOGetByTag(cameraControlConfig()->ioTag);
|
||||
IOInit(cameraControlRuntime.io, OWNER_CAMERA_CONTROL, 0);
|
||||
|
||||
if (CAMERA_CONTROL_MODE_HARDWARE_PWM == cameraControlConfig()->mode) {
|
||||
#ifdef CAMERA_CONTROL_HARDWARE_PWM_AVAILABLE
|
||||
const timerHardware_t *timerHardware = timerGetByTag(cameraControlConfig()->ioTag, TIM_USE_ANY);
|
||||
|
||||
if (!timerHardware) {
|
||||
return;
|
||||
}
|
||||
|
||||
#ifdef USE_HAL_DRIVER
|
||||
IOConfigGPIOAF(cameraControlRuntime.io, IOCFG_AF_PP, timerHardware->alternateFunction);
|
||||
#else
|
||||
IOConfigGPIO(cameraControlRuntime.io, IOCFG_AF_PP);
|
||||
#endif
|
||||
|
||||
pwmOutConfig(&cameraControlRuntime.channel, timerHardware, CAMERA_CONTROL_TIMER_MHZ * 1000000, CAMERA_CONTROL_PWM_RESOLUTION, 0, 0);
|
||||
|
||||
*cameraControlRuntime.channel.ccr = cameraControlRuntime.period;
|
||||
cameraControlRuntime.enabled = true;
|
||||
#endif
|
||||
} else if (CAMERA_CONTROL_MODE_SOFTWARE_PWM == cameraControlConfig()->mode) {
|
||||
#ifdef CAMERA_CONTROL_SOFTWARE_PWM_AVAILABLE
|
||||
IOConfigGPIO(cameraControlRuntime.io, IOCFG_OUT_PP);
|
||||
IOHi(cameraControlRuntime.io);
|
||||
|
||||
cameraControlRuntime.period = CAMERA_CONTROL_SOFT_PWM_RESOLUTION;
|
||||
cameraControlRuntime.enabled = true;
|
||||
|
||||
NVIC_InitTypeDef nvicTIM6 = {
|
||||
TIM6_DAC_IRQn, NVIC_PRIORITY_BASE(NVIC_PRIO_TIMER), NVIC_PRIORITY_SUB(NVIC_PRIO_TIMER), ENABLE
|
||||
};
|
||||
NVIC_Init(&nvicTIM6);
|
||||
NVIC_InitTypeDef nvicTIM7 = {
|
||||
TIM7_IRQn, NVIC_PRIORITY_BASE(NVIC_PRIO_TIMER), NVIC_PRIORITY_SUB(NVIC_PRIO_TIMER), ENABLE
|
||||
};
|
||||
NVIC_Init(&nvicTIM7);
|
||||
|
||||
RCC->APB1ENR |= RCC_APB1Periph_TIM6 | RCC_APB1Periph_TIM7;
|
||||
TIM6->PSC = 0;
|
||||
TIM7->PSC = 0;
|
||||
#endif
|
||||
} else if (CAMERA_CONTROL_MODE_DAC == cameraControlConfig()->mode) {
|
||||
// @todo not yet implemented
|
||||
}
|
||||
}
|
||||
|
||||
void cameraControlProcess(uint32_t currentTimeUs)
|
||||
{
|
||||
if (endTimeMillis && currentTimeUs >= 1000 * endTimeMillis) {
|
||||
if (CAMERA_CONTROL_MODE_HARDWARE_PWM == cameraControlConfig()->mode) {
|
||||
*cameraControlRuntime.channel.ccr = cameraControlRuntime.period;
|
||||
} else if (CAMERA_CONTROL_MODE_SOFTWARE_PWM == cameraControlConfig()->mode) {
|
||||
|
||||
}
|
||||
|
||||
endTimeMillis = 0;
|
||||
}
|
||||
}
|
||||
|
||||
static const int cameraPullUpResistance = 47000;
|
||||
static const int buttonResistanceValues[] = { 45000, 27000, 15000, 6810, 0 };
|
||||
|
||||
static float calculateKeyPressVoltage(const cameraControlKey_e key)
|
||||
{
|
||||
const int buttonResistance = buttonResistanceValues[key];
|
||||
return 1.0e-2f * cameraControlConfig()->refVoltage * buttonResistance / (cameraPullUpResistance + buttonResistance);
|
||||
}
|
||||
|
||||
#if defined(CAMERA_CONTROL_HARDWARE_PWM_AVAILABLE) || defined(CAMERA_CONTROL_SOFTWARE_PWM_AVAILABLE)
|
||||
static float calculatePWMDutyCycle(const cameraControlKey_e key)
|
||||
{
|
||||
const float voltage = calculateKeyPressVoltage(key);
|
||||
|
||||
return voltage / ADC_VOLTAGE;
|
||||
}
|
||||
#endif
|
||||
|
||||
void cameraControlKeyPress(cameraControlKey_e key, uint32_t holdDurationMs)
|
||||
{
|
||||
if (!cameraControlRuntime.enabled)
|
||||
return;
|
||||
|
||||
if (key >= CAMERA_CONTROL_KEYS_COUNT)
|
||||
return;
|
||||
|
||||
#if defined(CAMERA_CONTROL_HARDWARE_PWM_AVAILABLE) || defined(CAMERA_CONTROL_SOFTWARE_PWM_AVAILABLE)
|
||||
const float dutyCycle = calculatePWMDutyCycle(key);
|
||||
#else
|
||||
(void) holdDurationMs;
|
||||
#endif
|
||||
|
||||
if (CAMERA_CONTROL_MODE_HARDWARE_PWM == cameraControlConfig()->mode) {
|
||||
#ifdef CAMERA_CONTROL_HARDWARE_PWM_AVAILABLE
|
||||
*cameraControlRuntime.channel.ccr = lrintf(dutyCycle * cameraControlRuntime.period);
|
||||
endTimeMillis = millis() + cameraControlConfig()->keyDelayMs + holdDurationMs;
|
||||
#endif
|
||||
} else if (CAMERA_CONTROL_MODE_SOFTWARE_PWM == cameraControlConfig()->mode) {
|
||||
#ifdef CAMERA_CONTROL_SOFTWARE_PWM_AVAILABLE
|
||||
const uint32_t hiTime = lrintf(dutyCycle * cameraControlRuntime.period);
|
||||
|
||||
if (0 == hiTime) {
|
||||
IOLo(cameraControlRuntime.io);
|
||||
delay(cameraControlConfig()->keyDelayMs + holdDurationMs);
|
||||
IOHi(cameraControlRuntime.io);
|
||||
} else {
|
||||
TIM6->CNT = hiTime;
|
||||
TIM6->ARR = cameraControlRuntime.period;
|
||||
|
||||
TIM7->CNT = 0;
|
||||
TIM7->ARR = cameraControlRuntime.period;
|
||||
|
||||
// Start two timers as simultaneously as possible
|
||||
ATOMIC_BLOCK(NVIC_PRIO_TIMER) {
|
||||
TIM6->CR1 = TIM_CR1_CEN;
|
||||
TIM7->CR1 = TIM_CR1_CEN;
|
||||
}
|
||||
|
||||
// Enable interrupt generation
|
||||
TIM6->DIER = TIM_IT_Update;
|
||||
TIM7->DIER = TIM_IT_Update;
|
||||
|
||||
const uint32_t endTime = millis() + cameraControlConfig()->keyDelayMs + holdDurationMs;
|
||||
|
||||
// Wait to give the camera a chance at registering the key press
|
||||
while (millis() < endTime);
|
||||
|
||||
// Disable timers and interrupt generation
|
||||
TIM6->CR1 &= ~TIM_CR1_CEN;
|
||||
TIM7->CR1 &= ~TIM_CR1_CEN;
|
||||
TIM6->DIER = 0;
|
||||
TIM7->DIER = 0;
|
||||
|
||||
// Reset to idle state
|
||||
IOHi(cameraControlRuntime.io);
|
||||
}
|
||||
#endif
|
||||
} else if (CAMERA_CONTROL_MODE_DAC == cameraControlConfig()->mode) {
|
||||
// @todo not yet implemented
|
||||
}
|
||||
}
|
||||
|
||||
#endif
|
Loading…
Add table
Add a link
Reference in a new issue