|
| 1 | +.. _common-stellarf4: |
| 2 | +[copywiki destination="plane,copter,rover,blimp"] |
| 3 | +=========================== |
| 4 | +StellarF4 Flight Controller |
| 5 | +=========================== |
| 6 | +StellarF4 is an autopilot by `Stingbee <https://stingbee.com.ua/flight_controllers/stellarf4>`__. |
| 7 | + |
| 8 | +Features |
| 9 | +======== |
| 10 | + |
| 11 | +* Processor |
| 12 | + * STM32F405 |
| 13 | +* Sensors |
| 14 | + * ICM-42688p/BMI270 Acc/Gyro |
| 15 | + * DPS310/BMP280 barometer |
| 16 | + * AT7456E OSD |
| 17 | + * W25Q128 dataflash |
| 18 | +* Power |
| 19 | + * 2S-6S Lipo input voltage with voltage monitoring |
| 20 | + * 12V, 3A BEC for powering Video Transmitter |
| 21 | + * 5V, 2A BEC for internal and peripherals |
| 22 | +* Interfaces |
| 23 | + * 10x PWM outputs DShot capable, PWM1-4 DShot capable |
| 24 | + * 6x UARTs |
| 25 | + * 1x I2C |
| 26 | + * 2x ADC |
| 27 | + * SPI flash for logging |
| 28 | + * USB-C port |
| 29 | +* LED |
| 30 | + * Red, 3.3V power indicator |
| 31 | + * Green, FC status |
| 32 | +* Size |
| 33 | + * 41 x 41mm PCB with 30.5mm M3 mounting |
| 34 | + |
| 35 | +Pinout |
| 36 | +====== |
| 37 | + |
| 38 | +.. image:: ../../../images/StellarF4-top.png |
| 39 | + :target: ../_images/StellarF4-top.png |
| 40 | + |
| 41 | +.. image:: ../../../images/StellarF4-bot.png |
| 42 | + :target: ../_images/StellarF4-bot.png |
| 43 | + |
| 44 | +UART Mapping |
| 45 | +============ |
| 46 | +The UARTs are marked RXn and TXn in the above pinouts. The RXn pin is the |
| 47 | +receive pin for UARTn. The TXn pin is the transmit pin for UARTn. |
| 48 | + |
| 49 | +- SERIAL0 -> USB |
| 50 | +- SERIAL1 -> USART1 (DJI / VTX, DMA capable) |
| 51 | +- SERIAL2 -> USART2 (Serial RC input, DMA capable) |
| 52 | +- SERIAL3 -> USART3 (User) (NO DMA) |
| 53 | +- SERIAL4 -> UART4 (User) (NO DMA) |
| 54 | +- SERIAL5 -> UART5 (ESC Telemetry) (NO DMA) |
| 55 | +- SERIAL6 -> USART6 (GPS) (NO DMA) |
| 56 | + |
| 57 | +RC Input |
| 58 | +======== |
| 59 | +The default RC input is configured on the UART2(SERIAL1) RX2 input and can be used for all ArduPilot supported unidirectional receiver protocols except PPM. |
| 60 | + |
| 61 | +* SBUS/DSM/SRXL connects to the RX2 pin. |
| 62 | +* CRSF also requires a TX2 connection, in addition to RX2, and automatically provides telemetry. |
| 63 | +* FPort requires connection to TX2 and :ref:`SERIAL1_OPTIONS<SERIAL1_OPTIONS>` set to "7". See :ref:`common-FPort-receivers`. |
| 64 | +* SRXL2 requires a connection to TX2 and automatically provides telemetry. Set :ref:`SERIAL1_OPTIONS<SERIAL1_OPTIONS>` to “4”. |
| 65 | + |
| 66 | +OSD Support |
| 67 | +=========== |
| 68 | +StellarF4 supports using its internal OSD using OSD_TYPE 1 (MAX7456 driver). |
| 69 | +External OSD support such as DJI or DisplayPort can be used simultaneously and is preconfigured on SERIAL3 but can be supported on any spare UART. See :ref:`common-msp-osd-overview-4.2` for more info. |
| 70 | + |
| 71 | +PWM Output |
| 72 | +========== |
| 73 | +StellarF4 supports up to 10 PWM/Dshot outputs. PWM1-4 outputs support Bi-Directional DShot. |
| 74 | + |
| 75 | +Channels 1-4 support bi-directional DShot. Channels 1-8 marked as M1-M8 on the board. Channels 9-10 marked as S1-S2 on the board. PWM outputs are grouped and every group must use the same output protocol: |
| 76 | + |
| 77 | + |
| 78 | +* 1, 2, 3, 4 are Group 1; |
| 79 | +* 5, 6, 7, 8 are Group 2; |
| 80 | +* 9 is Group 3; |
| 81 | +* 10 is Group 4; |
| 82 | + |
| 83 | +Battery Monitoring |
| 84 | +================== |
| 85 | +The board has 1 built-in voltage divider on an ADC input and 1x current ADC input and supports an external 3.3V based current sensor. The voltage input is compatible with 2~6S LiPo batteries. |
| 86 | + |
| 87 | +The default battery parameters are: |
| 88 | + |
| 89 | +* :ref:`BATT_MONITOR<BATT_MONITOR>` = 4 |
| 90 | +* :ref:`BATT_VOLT_PIN<BATT_VOLT_PIN__AP_BattMonitor_Analog>` = 10 |
| 91 | +* :ref:`BATT_CURR_PIN<BATT_CURR_PIN__AP_BattMonitor_Analog>` = 11 (CURR pin) |
| 92 | +* :ref:`BATT_VOLT_MULT<BATT_VOLT_MULT__AP_BattMonitor_Analog>` = 11 |
| 93 | +* :ref:`BATT_AMP_PERVLT<BATT_AMP_PERVLT__AP_BattMonitor_Analog>` = 52.7 |
| 94 | + |
| 95 | +Compass |
| 96 | +======= |
| 97 | +StellarF4 does not have a built-in compass, but you can attach an external compass using I2C on the SDA and SCL pads. |
| 98 | + |
| 99 | +Camera Switch |
| 100 | +============= |
| 101 | +GPIO 81 controls which camera input (CAM1 or CAM2) is applied to the internal OSD. A :ref:`RELAY <common-relay>` function can be enabled to control the switching. |
| 102 | + |
| 103 | +Loading Firmware |
| 104 | +================ |
| 105 | +Firmware for these boards can be found at https://firmware.ardupilot.org in sub-folders labeled StellarF4. |
| 106 | + |
| 107 | +Initial firmware load can be done with DFU by plugging in USB with the |
| 108 | +boot button pressed. Then you should load the "ardu*_with_bl.hex" firmware, using your favourite DFU loading tool. eg STM32CubeProgrammer |
| 109 | + |
| 110 | +Subsequently, you can update firmware with Mission Planner. |
0 commit comments