Compare commits

...

42 Commits

Author SHA1 Message Date
那个Zeng c0cc1ba6d0 增加测试打印消息 3 years ago
zbr3550 d76bd9645e add tfmini iic 2,编译通过 3 years ago
zbr3550 ea00db03ee add tfmini iic 1 3 years ago
孤帆远影Faraway 05f22821ef
update .gitmodules. 3 years ago
honglang 55374fe589
boards: CUAV-x7pro: reoder brick to fixed cuav hvpm cannot detect voltage 3 years ago
Daniel Agar 2e8918da66
boards: cubepilot_cubeorange only start ADSB mavlink if console not present 3 years ago
Daniel Agar 5def17b1af
Jenkins: hardware remove boards that aren't present 3 years ago
Daniel Agar 1daf0654ff
boards: px4_fmu-v5_opitmized disable unused modules to save flash 3 years ago
Daniel Agar 6e3a2314cb
boards: px4_fmu-v2_default disable systemcmds/top to save flash 3 years ago
Sander Swart 6121b287f1
Removed TEL3 from cube orange default.cmake as it is used for the built in ADS-B receiver 3 years ago
Sander Swart c0980bd273
Added new line at the end of the file as per code style 3 years ago
Sander Swart 42d14e6072
Enable Cube Orange built in ADS-B receiver by default 3 years ago
Daniel Agar ba0b512f0d
boards: Holybro H7 boards clear MPU early in board init 3 years ago
Daniel Agar 7476a2953e
boards: CUAV H7 boards clear MPU early in board init 3 years ago
Lorenz Meier 15e6ca9e1e
MRO: Set up MPU after boot to app 3 years ago
Daniel Agar b9e7063237
boards: cube orange fully clear any existing MPU configuration as soon as possible 3 years ago
Daniel Agar 0a6045367f
px4io_serial: ensure TX DMA is stopped if exiting early on stream error 3 years ago
Daniel Agar 3f88a6d0bf
boards: cubeorange/cubeyellow use amber LED for armed state 3 years ago
Jukka Laitinen d1c09ec358
Fix memory corruption when work queue is being deleted 3 years ago
Daniel Agar ca744626cd boards: io-v2 increase idle thread stack 280 -> 316 bytes 3 years ago
Daniel Agar ea577f15b9 px4iofirmware: never directly touch mixer from isr 3 years ago
Daniel Agar d9f3c820ab sensors: always start baro/GPS/mag aggregators if SYS_HAS_* set 4 years ago
David Sidrane 8e57a62c9d rgbled_ncp5623c:Add comand line mapping of PWM to color 4 years ago
David Sidrane b961f6a1e1 rgbled_ncp5623c:Needs 2 retries 4 years ago
David Sidrane 09140c01bf rgbled_ncp5623c:Can change address, return actual 4 years ago
David Sidrane 822ae46235 rgbled_ncp5623c:Document support for ncp5623[c|b] parts 4 years ago
David Sidrane f70381dfdd i2c_spi_buses:Support devices that may change address 4 years ago
David Sidrane 84066f574d vcm1193l:Bug Fix set default address 4 years ago
David Sidrane c8426da50d px4_fmu-v5x:Newer HW Start BARRO on bus 2 4 years ago
David Sidrane 6bab917a3d px4_fmu-v6x:Use HB 10pin GPS rotation 4 years ago
David Sidrane 531301e176 px4_fmu-v5x:Use HB 10pin GPS rotation 4 years ago
David Sidrane 04f4157828 rcS:Scope netman to all 5X and 6X 4 years ago
Daniel Agar c5f82ed838
ekf2: fix sensor_combined last_generation 4 years ago
Daniel Agar 99501b4c38
flight_mode_manager: ManualAcceleration support weathervane yaw handler 4 years ago
Daniel Agar 9e4a04f58a
mavlink: receiver fix HIL_STATE_QUATERNION map projection init 4 years ago
Daniel Agar 1682fd5671
boards: px4_fmu-v2 disable load_mon module to save flash 4 years ago
bresch a8572f0fdd
ECL: update to include latest bugfixes 4 years ago
Daniel Agar a299a3bbd0
sensors: populate sensors_status_imu healthy flags even in multi-EKF mode 4 years ago
Julian Oes 349dd63072
mavlink: fix offboard velocity input 4 years ago
David Sidrane 6b51c6390a
Revert "nxp_fmuk66-v3:DMA Poll not needed" 4 years ago
David Sidrane 4f7909ee8e
Revert "nxp_fmuk66-e:DMA Poll not needed" 4 years ago
David Sidrane cbb48f9af3
NuttX with Kinetis SerialPoll back in 4 years ago
  1. 147
      .ci/Jenkinsfile-hardware
  2. 40
      .gitmodules
  3. 2
      ROMFS/px4fmu_common/init.d/rcS
  4. 12
      boards/cuav/nora/src/init.c
  5. 4
      boards/cuav/x7pro/src/board_config.h
  6. 12
      boards/cuav/x7pro/src/init.c
  7. 2
      boards/cubepilot/cubeorange/default.cmake
  8. 6
      boards/cubepilot/cubeorange/init/rc.board_mavlink
  9. 2
      boards/cubepilot/cubeorange/src/board_config.h
  10. 12
      boards/cubepilot/cubeorange/src/init.c
  11. 2
      boards/cubepilot/cubeyellow/src/board_config.h
  12. 2
      boards/cubepilot/io-v2/nuttx-config/nsh/defconfig
  13. 12
      boards/holybro/durandal-v1/src/init.c
  14. 12
      boards/mro/ctrl-zero-h7-oem/src/init.c
  15. 12
      boards/mro/ctrl-zero-h7/src/init.c
  16. 12
      boards/mro/pixracerpro/src/init.c
  17. 19
      boards/nxp/fmuk66-e/src/init.c
  18. 19
      boards/nxp/fmuk66-v3/src/init.c
  19. 4
      boards/px4/fmu-v2/default.cmake
  20. 2
      boards/px4/fmu-v2/multicopter.cmake
  21. 5
      boards/px4/fmu-v5/optimized.cmake
  22. 9
      boards/px4/fmu-v5x/init/rc.board_sensors
  23. 3
      boards/px4/fmu-v6x/init/rc.board_sensors
  24. 2
      boards/px4/io-v2/nuttx-config/nsh/defconfig
  25. 8
      build_fmuv2.sh
  26. 2
      cmake/px4_add_common_flags.cmake
  27. 8
      fmuv2_build.sh
  28. 12
      platforms/common/i2c_spi_buses.cpp
  29. 4
      platforms/common/include/px4_platform_common/i2c_spi_buses.h
  30. 1
      platforms/common/include/px4_platform_common/px4_work_queue/WorkQueue.hpp
  31. 22
      platforms/common/px4_work_queue/WorkQueue.cpp
  32. 1
      platforms/common/px4_work_queue/WorkQueueManager.cpp
  33. 2
      platforms/nuttx/NuttX/nuttx
  34. 2
      platforms/nuttx/src/px4/stm/stm32f7/px4io_serial/px4io_serial.cpp
  35. 2
      platforms/nuttx/src/px4/stm/stm32h7/px4io_serial/px4io_serial.cpp
  36. 1
      src/drivers/distance_sensor/CMakeLists.txt
  37. 43
      src/drivers/distance_sensor/tfmini_i2c/CMakeLists.txt
  38. 646
      src/drivers/distance_sensor/tfmini_i2c/tfmini_i2c.cpp
  39. 203
      src/drivers/distance_sensor/tfmini_i2c/tfmini_i2c.h
  40. 142
      src/drivers/distance_sensor/tfmini_i2c/tfmini_i2c_main.cpp
  41. 2
      src/drivers/drv_sensor.h
  42. 99
      src/drivers/lights/rgbled_ncp5623c/rgbled_ncp5623c.cpp
  43. 6
      src/drivers/magnetometer/hmc5883/hmc5883_i2c.cpp
  44. 3
      src/drivers/magnetometer/hmc5883/hmc5883_main.cpp
  45. 2
      src/drivers/magnetometer/vtrantech/vcm1193l/vcm1193l_main.cpp
  46. 2
      src/lib/ecl
  47. 14
      src/lib/systemlib/system_params.c
  48. 2
      src/modules/ekf2/EKF2.cpp
  49. 12
      src/modules/flight_mode_manager/tasks/ManualAcceleration/FlightTaskManualAcceleration.cpp
  50. 7
      src/modules/flight_mode_manager/tasks/ManualAcceleration/FlightTaskManualAcceleration.hpp
  51. 74
      src/modules/mavlink/mavlink_receiver.cpp
  52. 3
      src/modules/mavlink/mavlink_receiver.h
  53. 97
      src/modules/px4iofirmware/mixer.cpp
  54. 5
      src/modules/px4iofirmware/px4io.h
  55. 5
      src/modules/px4iofirmware/registers.c
  56. 21
      src/modules/sensors/sensors.cpp
  57. 5
      src/modules/sensors/voted_sensors_update.cpp
  58. 8
      upload_fmuv3.sh

147
.ci/Jenkinsfile-hardware

@ -673,153 +673,6 @@ pipeline { @@ -673,153 +673,6 @@ pipeline {
}
}
stage("modalai_fc-v1_test") {
stages {
stage("build modalai_fc-v1_test") {
agent {
docker {
image 'px4io/px4-dev-nuttx-focal:2021-04-29'
args '-e CCACHE_BASEDIR=$WORKSPACE -v ${CCACHE_DIR}:${CCACHE_DIR}:rw'
}
}
steps {
checkout scm
sh 'export'
sh 'make distclean'
sh 'ccache -s'
sh 'git fetch --tags'
sh 'make modalai_fc-v1_test'
sh 'make sizes'
sh 'ccache -s'
stash includes: 'build/*/*.elf, platforms/nuttx/Debug/upload_jlink_gdb.sh, Tools/HIL/*.py', name: 'modalai_fc-v1_test'
}
post {
always {
sh 'make distclean'
}
}
} // stage build
stage("test") {
agent {
label 'modalai_fc-v1'
}
stages {
stage("flash") {
steps {
sh 'export'
sh 'find /dev/serial'
unstash 'modalai_fc-v1_test'
// flash board and watch bootup
sh './platforms/nuttx/Debug/upload_jlink_gdb.sh build/modalai_fc-v1_test/modalai_fc-v1_test.elf && ./Tools/HIL/monitor_firmware_upload.py --device `find /dev/serial -name *usb-*` --baudrate 57600'
}
}
stage("configure") {
steps {
// configure
sh './Tools/HIL/run_nsh_cmd.py --device `find /dev/serial -name *usb-*` --cmd "param set CBRK_BUZZER 782097"' // disable buzzer
sh './Tools/HIL/run_nsh_cmd.py --device `find /dev/serial -name *usb-*` --cmd "param set SYS_AUTOSTART 4001"' // generic quadcopter
sh './Tools/HIL/run_nsh_cmd.py --device `find /dev/serial -name *usb-*` --cmd "param set SYS_BL_UPDATE 1"' // update bootloader
sh './Tools/HIL/run_nsh_cmd.py --device `find /dev/serial -name *usb-*` --cmd "param save"'
sh './Tools/HIL/run_nsh_cmd.py --device `find /dev/serial -name *usb-*` --cmd "param status"'
sh './Tools/HIL/run_nsh_cmd.py --device `find /dev/serial -name *usb-*` --cmd "reboot" || true' // reboot to apply
sh './Tools/HIL/run_nsh_cmd.py --device `find /dev/serial -name *usb-*` --cmd "param show"'
}
}
stage("status") {
steps {
statusFTDI()
}
}
stage("tests") {
steps {
// run tests
sh './Tools/HIL/run_tests.py --device `find /dev/serial -name *usb-*`'
}
}
stage("reset") {
steps {
cleanupFTDI()
}
}
}
} // stage test
}
}
stage("holybro_durandal-v1_test") {
stages {
stage("build holybro_durandal-v1_test") {
agent {
docker {
image 'px4io/px4-dev-nuttx-focal:2021-04-29'
args '-e CCACHE_BASEDIR=$WORKSPACE -v ${CCACHE_DIR}:${CCACHE_DIR}:rw'
}
}
steps {
checkout scm
sh 'export'
sh 'make distclean'
sh 'ccache -s'
sh 'git fetch --tags'
sh 'make holybro_durandal-v1_test'
sh 'make sizes'
sh 'ccache -s'
stash includes: 'build/*/*.elf, platforms/nuttx/Debug/upload_jlink_gdb.sh, Tools/HIL/*.py', name: 'holybro_durandal-v1_test'
}
post {
always {
sh 'make distclean'
}
}
} // stage build
stage("test") {
agent {
label 'holybro_durandal-v1'
}
stages {
stage("flash") {
steps {
sh 'export'
sh 'find /dev/serial'
unstash 'holybro_durandal-v1_test'
// flash board and watch bootup
sh './platforms/nuttx/Debug/upload_jlink_gdb.sh build/holybro_durandal-v1_test/holybro_durandal-v1_test.elf && ./Tools/HIL/monitor_firmware_upload.py --device `find /dev/serial -name *usb-*` --baudrate 57600'
}
}
stage("configure") {
steps {
// configure
sh './Tools/HIL/run_nsh_cmd.py --device `find /dev/serial -name *usb-*` --cmd "param set CBRK_BUZZER 782097"' // disable buzzer
sh './Tools/HIL/run_nsh_cmd.py --device `find /dev/serial -name *usb-*` --cmd "param set SYS_AUTOSTART 4001"' // generic quadcopter
sh './Tools/HIL/run_nsh_cmd.py --device `find /dev/serial -name *usb-*` --cmd "param set SYS_BL_UPDATE 1"' // update bootloader
sh './Tools/HIL/run_nsh_cmd.py --device `find /dev/serial -name *usb-*` --cmd "param save"'
sh './Tools/HIL/run_nsh_cmd.py --device `find /dev/serial -name *usb-*` --cmd "param status"'
sh './Tools/HIL/run_nsh_cmd.py --device `find /dev/serial -name *usb-*` --cmd "reboot" || true' // reboot to apply
sh './Tools/HIL/run_nsh_cmd.py --device `find /dev/serial -name *usb-*` --cmd "param show"'
}
}
stage("status") {
steps {
sh './Tools/HIL/run_nsh_cmd.py --device `find /dev/serial -name *usb-*` --cmd "dshot status"'
statusFTDI()
}
}
stage("tests") {
steps {
// run tests
sh './Tools/HIL/run_tests.py --device `find /dev/serial -name *usb-*`'
}
}
stage("reset") {
steps {
cleanupFTDI()
}
}
}
} // stage test
}
}
stage("nxp_fmuk66-v3_test") {
stages {
stage("build nxp_fmuk66-v3_test") {

40
.gitmodules vendored

@ -1,72 +1,72 @@ @@ -1,72 +1,72 @@
[submodule "mavlink/include/mavlink/v2.0"]
path = mavlink/include/mavlink/v2.0
url = https://github.com/mavlink/c_library_v2.git
url = https://gitee.com/nzeg/c_library_v2.git
branch = master
[submodule "src/drivers/uavcan/libuavcan"]
path = src/drivers/uavcan/libuavcan
url = https://github.com/PX4/libuavcan.git
url = https://gitee.com/nzeg/libuavcan_px4.git
branch = px4
[submodule "Tools/jMAVSim"]
path = Tools/jMAVSim
url = https://github.com/PX4/jMAVSim.git
url = https://gitee.com/nzeg/jMAVSim.git
branch = master
[submodule "Tools/sitl_gazebo"]
path = Tools/sitl_gazebo
url = https://github.com/PX4/PX4-SITL_gazebo.git
url = https://gitee.com/nzeg/PX4-SITL_gazebo.git
branch = master
[submodule "src/lib/matrix"]
path = src/lib/matrix
url = https://github.com/PX4/PX4-Matrix.git
url = https://gitee.com/nzeg/PX4-Matrix.git
branch = master
[submodule "src/lib/ecl"]
path = src/lib/ecl
url = https://github.com/PX4/PX4-ECL.git
url = https://gitee.com/nzeg/PX4-ECL.git
branch = master
[submodule "boards/atlflight/cmake_hexagon"]
path = boards/atlflight/cmake_hexagon
url = https://github.com/PX4/cmake_hexagon.git
url = https://gitee.com/nzeg/cmake_hexagon.git
branch = px4
[submodule "src/drivers/gps/devices"]
path = src/drivers/gps/devices
url = https://github.com/PX4/PX4-GPSDrivers.git
url = https://gitee.com/nzeg/PX4-GPSDrivers.git
branch = master
[submodule "src/modules/micrortps_bridge/micro-CDR"]
path = src/modules/micrortps_bridge/micro-CDR
url = https://github.com/PX4/Micro-CDR.git
url = https://gitee.com/nzeg/Micro-CDR.git
branch = master
[submodule "platforms/nuttx/NuttX/nuttx"]
path = platforms/nuttx/NuttX/nuttx
url = https://github.com/PX4/NuttX.git
url = https://gitee.com/nzeg/NuttX.git
branch = px4_firmware_nuttx-10.0.0+
[submodule "platforms/nuttx/NuttX/apps"]
path = platforms/nuttx/NuttX/apps
url = https://github.com/PX4/NuttX-apps.git
url = https://gitee.com/nzeg/NuttX-apps.git
branch = px4_firmware_nuttx-10.0.0+
[submodule "platforms/qurt/dspal"]
path = platforms/qurt/dspal
url = https://github.com/ATLFlight/dspal.git
url = https://gitee.com/nzeg/dspal.git
[submodule "Tools/flightgear_bridge"]
path = Tools/flightgear_bridge
url = https://github.com/PX4/PX4-FlightGear-Bridge.git
url = https://gitee.com/nzeg/PX4-FlightGear-Bridge.git
[submodule "Tools/jsbsim_bridge"]
path = Tools/jsbsim_bridge
url = https://github.com/PX4/px4-jsbsim-bridge.git
url = https://gitee.com/nzeg/px4-jsbsim-bridge.git
[submodule "src/drivers/uavcan_v1/libcanard"]
path = src/drivers/uavcan_v1/libcanard
url = https://github.com/UAVCAN/libcanard.git
url = https://gitee.com/nzeg/libcanard_px4.git
[submodule "src/drivers/uavcan_v1/public_regulated_data_types"]
path = src/drivers/uavcan_v1/public_regulated_data_types
url = https://github.com/UAVCAN/public_regulated_data_types.git
url = https://gitee.com/nzeg/public_regulated_data_types.git
[submodule "src/drivers/uavcannode_gps_demo/public_regulated_data_types"]
path = src/drivers/uavcannode_gps_demo/public_regulated_data_types
url = https://github.com/UAVCAN/public_regulated_data_types.git
url = https://gitee.com/nzeg/public_regulated_data_types.git
[submodule "src/drivers/uavcannode_gps_demo/libcanard"]
path = src/drivers/uavcannode_gps_demo/libcanard
url = https://github.com/UAVCAN/libcanard.git
url = https://gitee.com/nzeg/libcanard_px4.git
[submodule "src/drivers/uavcan_v1/legacy_data_types"]
path = src/drivers/uavcan_v1/legacy_data_types
url = https://github.com/PX4/public_regulated_data_types.git
url = https://gitee.com/nzeg/public_regulated_data_types_px42.git
branch = legacy
[submodule "src/lib/crypto/monocypher"]
path = src/lib/crypto/monocypher
url = https://github.com/PX4/Monocypher.git
url = https://gitee.com/nzeg/Monocypher.git

2
ROMFS/px4fmu_common/init.d/rcS

@ -128,7 +128,7 @@ else @@ -128,7 +128,7 @@ else
then
param reset_all
fi
if ver hwtypecmp V5X00 V5X90 V5Xa0
if ver hwcmp PX4_FMU_V5X PX4_FMU_V6X
then
netman update -i eth0
fi

12
boards/cuav/nora/src/init.c

@ -60,6 +60,8 @@ @@ -60,6 +60,8 @@
#include <px4_platform/gpio.h>
#include <px4_platform/board_dma_alloc.h>
#include <mpu.h>
__BEGIN_DECLS
extern void led_init(void);
extern void led_on(int led);
@ -127,6 +129,16 @@ __EXPORT void board_on_reset(int status) @@ -127,6 +129,16 @@ __EXPORT void board_on_reset(int status)
************************************************************************************/
__EXPORT void stm32_boardinitialize(void)
{
// clear all existing MPU configuration from bootloader
for (int region = 0; region < CONFIG_ARM_MPU_NREGIONS; region++) {
putreg32(region, MPU_RNR);
putreg32(0, MPU_RBAR);
putreg32(0, MPU_RASR);
// save
putreg32(0, MPU_CTRL);
}
/* Reset PWM first thing */
board_on_reset(-1);

4
boards/cuav/x7pro/src/board_config.h

@ -117,8 +117,8 @@ @@ -117,8 +117,8 @@
#define GPIO_nPOWER_IN_CAN /* PG2 */ (GPIO_INPUT|GPIO_PULLUP|GPIO_PORTG|GPIO_PIN2)
#define GPIO_nPOWER_IN_C /* PG0 */ (GPIO_INPUT|GPIO_PULLUP|GPIO_PORTG|GPIO_PIN0)
#define GPIO_nVDD_BRICK1_VALID GPIO_nPOWER_IN_CAN /* Brick 1 is Chosen */
#define GPIO_nVDD_BRICK2_VALID GPIO_nPOWER_IN_ADC /* Brick 2 is Chosen */
#define GPIO_nVDD_BRICK1_VALID GPIO_nPOWER_IN_ADC /* Brick 1 is Chosen */
#define GPIO_nVDD_BRICK2_VALID GPIO_nPOWER_IN_CAN /* Brick 2 is Chosen */
#define GPIO_nVDD_USB_VALID GPIO_nPOWER_IN_C /* USB is Chosen */
#define GPIO_VDD_5V_HIPOWER_EN /* PD11 */ (GPIO_OUTPUT|GPIO_PUSHPULL|GPIO_SPEED_2MHz|GPIO_OUTPUT_SET|GPIO_PORTD|GPIO_PIN11)

12
boards/cuav/x7pro/src/init.c

@ -60,6 +60,8 @@ @@ -60,6 +60,8 @@
#include <px4_platform/gpio.h>
#include <px4_platform/board_dma_alloc.h>
#include <mpu.h>
__BEGIN_DECLS
extern void led_init(void);
extern void led_on(int led);
@ -127,6 +129,16 @@ __EXPORT void board_on_reset(int status) @@ -127,6 +129,16 @@ __EXPORT void board_on_reset(int status)
************************************************************************************/
__EXPORT void stm32_boardinitialize(void)
{
// clear all existing MPU configuration from bootloader
for (int region = 0; region < CONFIG_ARM_MPU_NREGIONS; region++) {
putreg32(region, MPU_RNR);
putreg32(0, MPU_RBAR);
putreg32(0, MPU_RASR);
// save
putreg32(0, MPU_CTRL);
}
/* Reset PWM first thing */
board_on_reset(-1);

2
boards/cubepilot/cubeorange/default.cmake

@ -15,7 +15,7 @@ px4_add_board( @@ -15,7 +15,7 @@ px4_add_board(
TEL2:/dev/ttyS1
GPS1:/dev/ttyS2
# PX4IO:/dev/ttyS3
TEL3:/dev/ttyS4
# TEL3:/dev/ttyS4 # connected to ADS-B receiver
GPS2:/dev/ttyS5
DRIVERS
adc/ads1115

6
boards/cubepilot/cubeorange/init/rc.board_mavlink

@ -5,3 +5,9 @@ @@ -5,3 +5,9 @@
# Start MAVLink on the USB port
mavlink start -d /dev/ttyACM0
# Start ADS-B receiver mavlink connection if console not present
if [ ! -e /dev/console ]
then
mavlink start -d /dev/ttyS4 -b 57600 -m minimal
fi

2
boards/cubepilot/cubeorange/src/board_config.h

@ -62,7 +62,7 @@ @@ -62,7 +62,7 @@
#define GPIO_nLED_AMBER /* PE12 */ (GPIO_OUTPUT|GPIO_OPENDRAIN|GPIO_SPEED_50MHz|GPIO_OUTPUT_SET|GPIO_PORTE|GPIO_PIN12)
#define BOARD_HAS_CONTROL_STATUS_LEDS 1
#define BOARD_ARMED_STATE_LED LED_AMBER
#define BOARD_ARMED_LED LED_AMBER
/* ADC channels */
#define PX4_ADC_GPIO \

12
boards/cubepilot/cubeorange/src/init.c

@ -60,6 +60,8 @@ @@ -60,6 +60,8 @@
#include <px4_platform/gpio.h>
#include <px4_platform/board_dma_alloc.h>
#include <mpu.h>
__BEGIN_DECLS
extern void led_init(void);
extern void led_on(int led);
@ -118,6 +120,16 @@ __EXPORT void board_on_reset(int status) @@ -118,6 +120,16 @@ __EXPORT void board_on_reset(int status)
************************************************************************************/
__EXPORT void stm32_boardinitialize(void)
{
// clear all existing MPU configuration from bootloader
for (int region = 0; region < CONFIG_ARM_MPU_NREGIONS; region++) {
putreg32(region, MPU_RNR);
putreg32(0, MPU_RBAR);
putreg32(0, MPU_RASR);
// save
putreg32(0, MPU_CTRL);
}
/* Reset PWM first thing */
board_on_reset(-1);

2
boards/cubepilot/cubeyellow/src/board_config.h

@ -62,7 +62,7 @@ @@ -62,7 +62,7 @@
#define GPIO_nLED_AMBER /* PE12 */ (GPIO_OUTPUT|GPIO_OPENDRAIN|GPIO_SPEED_50MHz|GPIO_OUTPUT_SET|GPIO_PORTE|GPIO_PIN12)
#define BOARD_HAS_CONTROL_STATUS_LEDS 1
#define BOARD_ARMED_STATE_LED LED_AMBER
#define BOARD_ARMED_LED LED_AMBER
/* ADC channels */
#define PX4_ADC_GPIO \

2
boards/cubepilot/io-v2/nuttx-config/nsh/defconfig

@ -27,7 +27,7 @@ CONFIG_FDCLONE_DISABLE=y @@ -27,7 +27,7 @@ CONFIG_FDCLONE_DISABLE=y
CONFIG_FDCLONE_STDIO=y
CONFIG_HAVE_CXX=y
CONFIG_HAVE_CXXINITIALIZE=y
CONFIG_IDLETHREAD_STACKSIZE=280
CONFIG_IDLETHREAD_STACKSIZE=316
CONFIG_MAX_TASKS=2
CONFIG_MM_FILL_ALLOCATIONS=y
CONFIG_MM_SMALL=y

12
boards/holybro/durandal-v1/src/init.c

@ -75,6 +75,8 @@ @@ -75,6 +75,8 @@
#include <px4_platform/board_determine_hw_info.h>
#include <px4_platform/board_dma_alloc.h>
#include <mpu.h>
/****************************************************************************
* Pre-Processor Definitions
****************************************************************************/
@ -160,6 +162,16 @@ __EXPORT void board_on_reset(int status) @@ -160,6 +162,16 @@ __EXPORT void board_on_reset(int status)
__EXPORT void
stm32_boardinitialize(void)
{
// clear all existing MPU configuration from bootloader
for (int region = 0; region < CONFIG_ARM_MPU_NREGIONS; region++) {
putreg32(region, MPU_RNR);
putreg32(0, MPU_RBAR);
putreg32(0, MPU_RASR);
// save
putreg32(0, MPU_CTRL);
}
board_on_reset(-1); /* Reset PWM first thing */
/* configure LEDs */

12
boards/mro/ctrl-zero-h7-oem/src/init.c

@ -60,6 +60,8 @@ @@ -60,6 +60,8 @@
#include <px4_platform/gpio.h>
#include <px4_platform/board_dma_alloc.h>
#include <mpu.h>
__BEGIN_DECLS
extern void led_init(void);
extern void led_on(int led);
@ -121,6 +123,16 @@ __EXPORT void board_on_reset(int status) @@ -121,6 +123,16 @@ __EXPORT void board_on_reset(int status)
************************************************************************************/
__EXPORT void stm32_boardinitialize(void)
{
// clear all existing MPU configuration from bootloader
for (int region = 0; region < CONFIG_ARM_MPU_NREGIONS; region++) {
putreg32(region, MPU_RNR);
putreg32(0, MPU_RBAR);
putreg32(0, MPU_RASR);
// save
putreg32(0, MPU_CTRL);
}
/* Reset PWM first thing */
board_on_reset(-1);

12
boards/mro/ctrl-zero-h7/src/init.c

@ -60,6 +60,8 @@ @@ -60,6 +60,8 @@
#include <px4_platform/gpio.h>
#include <px4_platform/board_dma_alloc.h>
#include <mpu.h>
__BEGIN_DECLS
extern void led_init(void);
extern void led_on(int led);
@ -121,6 +123,16 @@ __EXPORT void board_on_reset(int status) @@ -121,6 +123,16 @@ __EXPORT void board_on_reset(int status)
************************************************************************************/
__EXPORT void stm32_boardinitialize(void)
{
// clear all existing MPU configuration from bootloader
for (int region = 0; region < CONFIG_ARM_MPU_NREGIONS; region++) {
putreg32(region, MPU_RNR);
putreg32(0, MPU_RBAR);
putreg32(0, MPU_RASR);
// save
putreg32(0, MPU_CTRL);
}
/* Reset PWM first thing */
board_on_reset(-1);

12
boards/mro/pixracerpro/src/init.c

@ -60,6 +60,8 @@ @@ -60,6 +60,8 @@
#include <px4_platform/gpio.h>
#include <px4_platform/board_dma_alloc.h>
#include <mpu.h>
__BEGIN_DECLS
extern void led_init(void);
extern void led_on(int led);
@ -121,6 +123,16 @@ __EXPORT void board_on_reset(int status) @@ -121,6 +123,16 @@ __EXPORT void board_on_reset(int status)
************************************************************************************/
__EXPORT void stm32_boardinitialize(void)
{
// clear all existing MPU configuration from bootloader
for (int region = 0; region < CONFIG_ARM_MPU_NREGIONS; region++) {
putreg32(region, MPU_RNR);
putreg32(0, MPU_RBAR);
putreg32(0, MPU_RASR);
// save
putreg32(0, MPU_CTRL);
}
/* Reset PWM first thing */
board_on_reset(-1);

19
boards/nxp/fmuk66-e/src/init.c

@ -235,6 +235,25 @@ __EXPORT int board_app_initialize(uintptr_t arg) @@ -235,6 +235,25 @@ __EXPORT int board_app_initialize(uintptr_t arg)
syslog(LOG_ERR, "DMA alloc FAILED\n");
}
/* set up the serial DMA polling */
#ifdef SERIAL_HAVE_DMA
static struct hrt_call serial_dma_call;
struct timespec ts;
/*
* Poll at 1ms intervals for received bytes that have not triggered
* a DMA event.
*/
ts.tv_sec = 0;
ts.tv_nsec = 1000000;
hrt_call_every(&serial_dma_call,
ts_to_abstime(&ts),
ts_to_abstime(&ts),
(hrt_callout)kinetis_serial_dma_poll,
NULL);
#endif
/* initial LED state */
drv_led_start();
led_off(LED_RED);

19
boards/nxp/fmuk66-v3/src/init.c

@ -235,6 +235,25 @@ __EXPORT int board_app_initialize(uintptr_t arg) @@ -235,6 +235,25 @@ __EXPORT int board_app_initialize(uintptr_t arg)
syslog(LOG_ERR, "DMA alloc FAILED\n");
}
/* set up the serial DMA polling */
#ifdef SERIAL_HAVE_DMA
static struct hrt_call serial_dma_call;
struct timespec ts;
/*
* Poll at 1ms intervals for received bytes that have not triggered
* a DMA event.
*/
ts.tv_sec = 0;
ts.tv_nsec = 1000000;
hrt_call_every(&serial_dma_call,
ts_to_abstime(&ts),
ts_to_abstime(&ts),
(hrt_callout)kinetis_serial_dma_poll,
NULL);
#endif
/* initial LED state */
drv_led_start();
led_off(LED_RED);

4
boards/px4/fmu-v2/default.cmake

@ -76,7 +76,7 @@ px4_add_board( @@ -76,7 +76,7 @@ px4_add_board(
#gyro_fft
land_detector
#landing_target_estimator
load_mon
#load_mon
#local_position_estimator
logger
mavlink
@ -118,7 +118,7 @@ px4_add_board( @@ -118,7 +118,7 @@ px4_add_board(
#sd_bench
#serial_test
#system_time
top
#top
#topic_listener
tune_control
#uorb

2
boards/px4/fmu-v2/multicopter.cmake

@ -48,7 +48,7 @@ px4_add_board( @@ -48,7 +48,7 @@ px4_add_board(
#events
land_detector
landing_target_estimator
load_mon
#load_mon
#local_position_estimator
logger
mavlink

5
boards/px4/fmu-v5/optimized.cmake

@ -23,7 +23,8 @@ px4_add_board( @@ -23,7 +23,8 @@ px4_add_board(
DRIVERS
adc/ads1115
adc/board_adc
barometer # all available barometer drivers
#barometer # all available barometer drivers
barometer/ms5611
batt_smbus
camera_capture
camera_trigger
@ -116,7 +117,7 @@ px4_add_board( @@ -116,7 +117,7 @@ px4_add_board(
perf
pwm
reboot
reflect
#reflect
sd_bench
#serial_test
system_time

9
boards/px4/fmu-v5x/init/rc.board_sensors

@ -55,17 +55,20 @@ else @@ -55,17 +55,20 @@ else
fi
# External compass on GPS1/I2C1 (the 3rd external bus): standard Holybro Pixhawk 4 or CUAV V5 GPS/compass puck (with lights, safety button, and buzzer)
ist8310 -X -b 1 -R 10 start
# Possible internal Baro
# Disable startup of internal baros if param is set to false
if param compare SENS_INT_BARO_EN 1
then
bmp388 -I -a 0x77 start
if ver hwtypecmp V5X91 V5Xa1
if ver hwtypecmp V5X00 V5X90 V5Xa0
then
bmp388 -X -b 2 start
else
bmp388 -I start
else
bmp388 -X -b 2 start
fi
fi

3
boards/px4/fmu-v6x/init/rc.board_sensors

@ -21,6 +21,9 @@ icm20649 -R 14 -s start @@ -21,6 +21,9 @@ icm20649 -R 14 -s start
# Internal magnetometer on I2c
bmm150 -I start
# External compass on GPS1/I2C1 (the 3rd external bus): standard Holybro Pixhawk 4 or CUAV V5 GPS/compass puck (with lights, safety button, and buzzer)
ist8310 -X -b 1 -R 10 start
# Possible internal Baro
bmp388 -I -a 0x77 start

2
boards/px4/io-v2/nuttx-config/nsh/defconfig

@ -27,7 +27,7 @@ CONFIG_FDCLONE_DISABLE=y @@ -27,7 +27,7 @@ CONFIG_FDCLONE_DISABLE=y
CONFIG_FDCLONE_STDIO=y
CONFIG_HAVE_CXX=y
CONFIG_HAVE_CXXINITIALIZE=y
CONFIG_IDLETHREAD_STACKSIZE=280
CONFIG_IDLETHREAD_STACKSIZE=316
CONFIG_MAX_TASKS=2
CONFIG_MM_FILL_ALLOCATIONS=y
CONFIG_MM_SMALL=y

8
build_fmuv2.sh

@ -0,0 +1,8 @@ @@ -0,0 +1,8 @@
date -R
starttime=`date +'%Y-%m-%d %H:%M:%S'`
make px4_fmu-v2_default
endtime=`date +'%Y-%m-%d %H:%M:%S'`
date -R
start_seconds=$(date --date="$starttime" +%s);
end_seconds=$(date --date="$endtime" +%s);
echo "本次运行时间: "$((end_seconds-start_seconds))"s"

2
cmake/px4_add_common_flags.cmake

@ -68,7 +68,7 @@ function(px4_add_common_flags) @@ -68,7 +68,7 @@ function(px4_add_common_flags)
# Warnings
-Wall
-Wextra
-Werror
#-Werror
-Warray-bounds
-Wcast-align

8
fmuv2_build.sh

@ -0,0 +1,8 @@ @@ -0,0 +1,8 @@
date -R
starttime=`date +'%Y-%m-%d %H:%M:%S'`
make px4_fmu-v3_default
endtime=`date +'%Y-%m-%d %H:%M:%S'`
date -R
start_seconds=$(date --date="$starttime" +%s);
end_seconds=$(date --date="$endtime" +%s);
echo "本次运行时间: "$((end_seconds-start_seconds))"s"

12
platforms/common/i2c_spi_buses.cpp

@ -461,6 +461,8 @@ struct I2CSPIDriverInitializing { @@ -461,6 +461,8 @@ struct I2CSPIDriverInitializing {
static void initializer_trampoline(void *argument)
{
I2CSPIDriverInitializing *data = (I2CSPIDriverInitializing *)argument;
printf("IN{%d} instance: %d\n",__LINE__,data->runtime_instance);
data->instance = data->instantiate(data->cli, data->iterator, data->runtime_instance);
}
@ -476,6 +478,7 @@ int I2CSPIDriverBase::module_start(const BusCLIArguments &cli, BusInstanceIterat @@ -476,6 +478,7 @@ int I2CSPIDriverBase::module_start(const BusCLIArguments &cli, BusInstanceIterat
bool started = false;
while (iterator.next()) {
printf("MS{%d} bus: %i\n",__LINE__, iterator.bus());
if (iterator.instance()) {
PX4_WARN("Already running on bus %i", iterator.bus());
continue;
@ -485,6 +488,7 @@ int I2CSPIDriverBase::module_start(const BusCLIArguments &cli, BusInstanceIterat @@ -485,6 +488,7 @@ int I2CSPIDriverBase::module_start(const BusCLIArguments &cli, BusInstanceIterat
device::Device::DeviceId device_id{};
device_id.devid_s.bus = iterator.bus();
printf("MS{%d} busType: %d\n",__LINE__,iterator.busType());
switch (iterator.busType()) {
case BOARD_I2C_BUS: device_id.devid_s.bus_type = device::Device::DeviceBusType_I2C; break;
@ -501,23 +505,29 @@ int I2CSPIDriverBase::module_start(const BusCLIArguments &cli, BusInstanceIterat @@ -501,23 +505,29 @@ int I2CSPIDriverBase::module_start(const BusCLIArguments &cli, BusInstanceIterat
initializer.wait();
I2CSPIDriverBase *instance = initializer_data.instance;
// printf("MS{%d} instance: %d\n",__LINE__,(int)instance);
if (!instance) {
PX4_DEBUG("instantiate failed (no device on bus %i (devid 0x%x)?)", iterator.bus(), iterator.devid());
printf("{%d}instantiate failed (no device on bus %i (devid 0x%02x)?)\n",__LINE__, iterator.bus(), device_id.devid);
continue;
}
printf("{%d}instantiate ok on bus %i (devid 0x%02x) \n",__LINE__, iterator.bus(), device_id.devid);
if (cli.i2c_address != 0 && instance->_i2c_address == 0) {
PX4_ERR("Bug: driver %s does not pass the I2C address to I2CSPIDriverBase", instance->ItemName());
printf("{%d}Bug: driver %s does not pass the I2C address to I2CSPIDriverBase\n",__LINE__, instance->ItemName());
}
iterator.addInstance(instance);
started = true;
printf("MS{%d} busType: %d\n",__LINE__,(int)iterator.busType());
// print some info that we are running
switch (iterator.busType()) {
case BOARD_I2C_BUS:
PX4_INFO_RAW("%s #%i on I2C bus %d", instance->ItemName(), runtime_instance, iterator.bus());
printf("MS{%d} addr: %02x, rot:%d\n",__LINE__,cli.i2c_address,cli.rotation);
if (iterator.external()) {
PX4_INFO_RAW(" (external)");
}
@ -642,7 +652,7 @@ void I2CSPIDriverBase::print_status() @@ -642,7 +652,7 @@ void I2CSPIDriverBase::print_status()
bool is_i2c_bus = _bus_option == I2CSPIBusOption::I2CExternal || _bus_option == I2CSPIBusOption::I2CInternal;
if (is_i2c_bus) {
PX4_INFO("Running on I2C Bus %i, Address 0x%02X", _bus, _i2c_address);
PX4_INFO("Running on I2C Bus %i, Address 0x%02X", _bus, get_i2c_address());
} else {
PX4_INFO("Running on SPI Bus %i", _bus);

4
platforms/common/include/px4_platform_common/i2c_spi_buses.h

@ -62,11 +62,13 @@ class I2CSPIInstance : public ListNode<I2CSPIInstance *> @@ -62,11 +62,13 @@ class I2CSPIInstance : public ListNode<I2CSPIInstance *>
{
public:
virtual ~I2CSPIInstance() = default;
virtual int8_t get_i2c_address() {return _i2c_address;}
private:
I2CSPIInstance(const char *module_name, I2CSPIBusOption bus_option, int bus, uint8_t i2c_address, uint16_t type)
: _module_name(module_name), _bus_option(bus_option), _bus(bus), _type(type), _i2c_address(i2c_address) {}
friend class BusInstanceIterator;
friend class I2CSPIDriverBase;
@ -85,6 +87,7 @@ public: @@ -85,6 +87,7 @@ public:
/**
* Parse CLI arguments (for drivers that don't need any custom arguments, otherwise getopt() should be used)
* CLI 使 getopt()
* @return command (e.g. "start") or nullptr on error or unknown argument
*/
const char *parseDefaultArguments(int argc, char *argv[]);
@ -137,6 +140,7 @@ private: @@ -137,6 +140,7 @@ private:
/**
* @class BusInstanceIterator
* Iterate over running instances and/or configured I2C/SPI buses with given filter options.
* 使 / I2C/SPI 线
*/
class BusInstanceIterator
{

1
platforms/common/include/px4_platform_common/px4_work_queue/WorkQueue.hpp

@ -96,6 +96,7 @@ private: @@ -96,6 +96,7 @@ private:
IntrusiveQueue<WorkItem *> _q;
px4_sem_t _process_lock;
px4_sem_t _exit_lock;
const wq_config_t &_config;
BlockingList<WorkItem *> _work_items;
px4::atomic_bool _should_exit{false};

22
platforms/common/px4_work_queue/WorkQueue.cpp

@ -59,11 +59,20 @@ WorkQueue::WorkQueue(const wq_config_t &config) : @@ -59,11 +59,20 @@ WorkQueue::WorkQueue(const wq_config_t &config) :
px4_sem_init(&_process_lock, 0, 0);
px4_sem_setprotocol(&_process_lock, SEM_PRIO_NONE);
px4_sem_init(&_exit_lock, 0, 1);
px4_sem_setprotocol(&_exit_lock, SEM_PRIO_NONE);
}
WorkQueue::~WorkQueue()
{
work_lock();
// Synchronize with ::Detach
px4_sem_wait(&_exit_lock);
px4_sem_destroy(&_exit_lock);
px4_sem_destroy(&_process_lock);
work_unlock();
@ -83,11 +92,14 @@ bool WorkQueue::Attach(WorkItem *item) @@ -83,11 +92,14 @@ bool WorkQueue::Attach(WorkItem *item)
}
work_unlock();
return false;
}
void WorkQueue::Detach(WorkItem *item)
{
bool exiting = false;
work_lock();
_work_items.remove(item);
@ -96,11 +108,21 @@ void WorkQueue::Detach(WorkItem *item) @@ -96,11 +108,21 @@ void WorkQueue::Detach(WorkItem *item)
// shutdown, no active WorkItems
PX4_DEBUG("stopping: %s, last active WorkItem closing", _config.name);
// Deletion of this work queue might happen right after request_stop or
// SignalWorkerThread. Use a separate lock to prevent premature deletion
px4_sem_wait(&_exit_lock);
exiting = true;
request_stop();
SignalWorkerThread();
}
work_unlock();
// In case someone is deleting this wq already, signal
// that it is now allowed
if (exiting) {
px4_sem_post(&_exit_lock);
}
}
void WorkQueue::Add(WorkItem *item)

1
platforms/common/px4_work_queue/WorkQueueManager.cpp

@ -127,6 +127,7 @@ device_bus_to_wq(uint32_t device_id_int) @@ -127,6 +127,7 @@ device_bus_to_wq(uint32_t device_id_int)
const device::Device::DeviceBusType bus_type = device_id.devid_s.bus_type;
const uint8_t bus = device_id.devid_s.bus;
printf("WQ{%d}id:%d type: %d,bus:%d\n",__LINE__,device_id_int,(int)bus_type,bus);
if (bus_type == device::Device::DeviceBusType_I2C) {
switch (bus) {
case 0: return wq_configurations::I2C0;

2
platforms/nuttx/NuttX/nuttx

@ -1 +1 @@ @@ -1 +1 @@
Subproject commit 76bb42f3ebd902102e844084b564274bf215ec9f
Subproject commit bf660cba2af81f055002b3817c87b1f63a78fd09

2
platforms/nuttx/src/px4/stm/stm32f7/px4io_serial/px4io_serial.cpp

@ -328,6 +328,8 @@ ArchPX4IOSerial::_bus_exchange(IOPacket *_packet) @@ -328,6 +328,8 @@ ArchPX4IOSerial::_bus_exchange(IOPacket *_packet)
if (ret == OK) {
/* check for DMA errors */
if (_rx_dma_status & DMA_STATUS_TEIF) {
// stream transfer error, ensure TX DMA is also stopped before exiting early
stm32_dmastop(_tx_dma);
perf_count(_pc_dmaerrs);
ret = -EIO;
break;

2
platforms/nuttx/src/px4/stm/stm32h7/px4io_serial/px4io_serial.cpp

@ -373,6 +373,8 @@ ArchPX4IOSerial::_bus_exchange(IOPacket *_packet) @@ -373,6 +373,8 @@ ArchPX4IOSerial::_bus_exchange(IOPacket *_packet)
if (ret == OK) {
/* check for DMA errors */
if (_rx_dma_status & DMA_STATUS_TEIF) {
// stream transfer error, ensure TX DMA is also stopped before exiting early
stm32_dmastop(_tx_dma);
perf_count(_pc_dmaerrs);
ret = -EIO;
break;

1
src/drivers/distance_sensor/CMakeLists.txt

@ -48,3 +48,4 @@ add_subdirectory(ulanding_radar) @@ -48,3 +48,4 @@ add_subdirectory(ulanding_radar)
add_subdirectory(vl53l0x)
add_subdirectory(vl53l1x)
add_subdirectory(gy_us42)
add_subdirectory(tfmini_i2c)

43
src/drivers/distance_sensor/tfmini_i2c/CMakeLists.txt

@ -0,0 +1,43 @@ @@ -0,0 +1,43 @@
############################################################################
#
# Copyright (c) 2015-2019 PX4 Development Team. All rights reserved.
#
# 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 PX4 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 OWNER 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.
#
############################################################################
px4_add_module(
MODULE drivers__tfmini_i2c
MAIN tfmini_i2c
COMPILE_FLAGS
-Wno-cast-align # TODO: fix and enable
SRCS
tfmini_i2c.cpp
tfmini_i2c_main.cpp
DEPENDS
drivers_rangefinder
)

646
src/drivers/distance_sensor/tfmini_i2c/tfmini_i2c.cpp

@ -0,0 +1,646 @@ @@ -0,0 +1,646 @@
/****************************************************************************
*
* Copyright (c) 2014-2019, 2021 PX4 Development Team. All rights reserved.
*
* 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 PX4 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 OWNER 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.
*
****************************************************************************/
/**
* @file TFmini_i2c.cpp
* @author Allyson Kreft
*
* Driver for the PulsedLight Lidar-Lite range finders connected via I2C.
*/
#include "tfmini_i2c.h"
#include <px4_platform_common/getopt.h>
#include <px4_platform_common/module.h>
#define ARRAY_SIZE(_arr) (sizeof(_arr) / sizeof(_arr[0]))
TFmini_i2c::TFmini_i2c(I2CSPIBusOption bus_option, const int bus, const uint8_t orientation, int bus_frequency,
const int address) :
I2C(DRV_DIST_DEVTYPE_TFMINI_I2C, MODULE_NAME, bus, address, bus_frequency),
I2CSPIDriver(MODULE_NAME, px4::device_bus_to_wq(get_device_id()), bus_option, bus),
_px4_rangefinder(get_device_id(), orientation)
{
_px4_rangefinder.set_min_distance(TFMINI_MIN_DISTANCE);
_px4_rangefinder.set_max_distance(TFMINI_MAX_DISTANCE);
_px4_rangefinder.set_fov(0.008); // Divergence 8 mRadian
// up the retries since the device misses the first measure attempts
_retries = 3;
_px4_rangefinder.set_device_type(DRV_DIST_DEVTYPE_TFMINI_I2C); /// TODO
}
TFmini_i2c::~TFmini_i2c()
{
perf_free(_sample_perf);
perf_free(_comms_errors);
perf_free(_sensor_resets);
perf_free(_sensor_zero_resets);
}
int
TFmini_i2c::init()
{
printf("TFmini_i2c: init() \n");
// Perform I2C init (and probe) first.
if (I2C::init() != PX4_OK) {
return PX4_ERROR;
}
int32_t hw_model = 1; // only one model so far...
switch (hw_model) {
case 1: // TFMINI (12m, 100 Hz)
// Note:
// Sensor specification shows 0.3m as minimum, but in practice
// 0.3 is too close to minimum so chattering of invalid sensor decision
// is happening sometimes. this cause EKF to believe inconsistent range readings.
// So we set 0.4 as valid minimum.
_px4_rangefinder.set_min_distance(0.4f);
_px4_rangefinder.set_max_distance(12.0f);
_px4_rangefinder.set_fov(math::radians(1.15f));
break;
default:
PX4_ERR("invalid HW model %" PRId32 ".", hw_model);
return -1;
}
return PX4_OK;
}
void
TFmini_i2c::print_status()
{
I2CSPIDriverBase::print_status();
perf_print_counter(_sample_perf);
perf_print_counter(_comms_errors);
perf_print_counter(_sensor_resets);
perf_print_counter(_sensor_zero_resets);
printf("poll interval: %" PRIu32 "\n", get_measure_interval());
}
int
TFmini_i2c::read_reg(const uint8_t reg, uint8_t &val)
{
return lidar_transfer(&reg, 1, &val, 1);
}
int
TFmini_i2c::write_reg(const uint8_t reg, const uint8_t &val)
{
const uint8_t cmd[2] = { reg, val };
return transfer(&cmd[0], 2, nullptr, 0);
}
int
TFmini_i2c::lidar_transfer(const uint8_t *send, const unsigned send_len, uint8_t *recv, const unsigned recv_len)
{
if (send != nullptr && send_len > 0) {
int ret = transfer(send, send_len, nullptr, 0);
if (ret != PX4_OK) {
return ret;
}
}
if (recv != nullptr && recv_len > 0) {
return transfer(nullptr, 0, recv, recv_len);
}
return PX4_ERROR;
}
int
TFmini_i2c::check_checksum(uint8_t *arr, int pkt_len)
{
uint8_t checksum = 0;
int i;
/* sum them all except the last (the checksum) */
for (i = 0; i < pkt_len - 1; i++) {
checksum += arr[i];
}
return checksum == arr[pkt_len - 1];
}
int
TFmini_i2c::probe()
{
printf("TFmini_i2c: probe() \n");
const uint8_t CMD_FW_VERSION[] = { 0x5A, 0x04, 0x01, 0x5F };
const uint8_t CMD_SYSTEM_RESET[] = { 0x5A, 0x04, 0x04, 0x62 };
const uint8_t CMD_OUTPUT_FORMAT_CM[] = { 0x5A, 0x05, 0x05, 0x01, 0x65 };
const uint8_t CMD_ENABLE_DATA_OUTPUT[] = { 0x5A, 0x05, 0x07, 0x01, 0x67 };
const uint8_t CMD_FRAME_RATE_250HZ[] = { 0x5A, 0x06, 0x03, 0xFA, 0x00, 0x5D };
const uint8_t CMD_SAVE_SETTINGS[] = { 0x5A, 0x04, 0x11, 0x6F };
const uint8_t *cmds[] = {
CMD_OUTPUT_FORMAT_CM,
CMD_FRAME_RATE_250HZ,
CMD_ENABLE_DATA_OUTPUT,
CMD_SAVE_SETTINGS,
};
uint8_t val[12], i;
int ret;
// cope with both old and new I2C bus address
const uint8_t addresses[2] = { TFMINI_BASEADDR, TFMINI_BASEADDR_OLD };
// more retries for detection
_retries = 10;
for (uint8_t i = 0; i < sizeof(addresses); i++) {
set_device_address(addresses[i]);
ret = lidar_transfer(CMD_FW_VERSION, sizeof(CMD_FW_VERSION), nullptr, 0);
if (ret != PX4_OK) {
goto fail;
}
px4_usleep(100_ms);
ret = lidar_transfer(nullptr, 0, val, 7);
if (!ret || val[0] != 0x5A || val[1] != 0x07 || val[2] != 0x01 ||
!check_checksum(val, 7)) {
goto fail;
}
if (val[5] * 10000 + val[4] * 100 + val[3] < 20003) {
PX4_INFO("TFMini: FW ver %u.%u.%u (need>=2.0.3)",(unsigned)val[5],(unsigned)val[4],(unsigned)val[3]);
goto fail;
}
PX4_INFO(": found fw version %u.%u.%u\n",val[5], val[4], val[3]);
for (i = 0; i < ARRAY_SIZE(cmds); i++) {
ret = lidar_transfer(cmds[i], cmds[i][1], nullptr, 0);
if (!ret) {
PX4_INFO(": Unable to set configuration register %u\n",cmds[i][2]);
goto fail;
}
px4_usleep(100_ms);
}
lidar_transfer(CMD_SYSTEM_RESET, sizeof(CMD_SYSTEM_RESET), nullptr, 0);
return OK;
}
fail:
// not found on any address
return -EIO;
}
int
TFmini_i2c::measure()
{
if (_pause_measurements) {
// we are in print_registers() and need to avoid
// acquisition to keep the I2C peripheral on the
// sensor active
return OK;
}
// Send the command to begin a measurement.
int ret = write_reg(TFMINI_MEASURE_REG, TFMINI_MSRREG_ACQUIRE);
if (ret != PX4_OK) {
perf_count(_comms_errors);
PX4_DEBUG("i2c::transfer returned %d", ret);
// if we are getting lots of I2C transfer errors try
// resetting the sensor
if (perf_event_count(_comms_errors) % 10 == 0) {
perf_count(_sensor_resets);
reset_sensor();
}
return ret;
}
// remember when we sent the acquire so we can know when the
// acquisition has timed out
_acquire_time_usec = hrt_absolute_time();
return OK;
}
int
TFmini_i2c::reset_sensor()
{
px4_usleep(15_ms);
int ret = write_reg(TFMINI_SIG_COUNT_VAL_REG, TFMINI_SIG_COUNT_VAL_MAX);
if (ret != PX4_OK) {
return ret;
}
px4_usleep(15_ms);
ret = write_reg(TFMINI_MEASURE_REG, TFMINI_MSRREG_RESET);
if (ret != PX4_OK) {
uint8_t sig_cnt;
px4_usleep(15_ms);
ret = read_reg(TFMINI_SIG_COUNT_VAL_REG, sig_cnt);
if ((ret != PX4_OK) || (sig_cnt != TFMINI_SIG_COUNT_VAL_DEFAULT)) {
PX4_INFO("Error: TFMINI reset failure. Exiting!\n");
return ret;
}
}
// wait for sensor reset to complete
px4_usleep(50_ms);
ret = write_reg(TFMINI_SIG_COUNT_VAL_REG, TFMINI_SIG_COUNT_VAL_MAX);
if (ret != PX4_OK) {
return ret;
}
// wait for register write to complete
px4_usleep(1_ms);
return OK;
}
void
TFmini_i2c::print_registers()
{
_pause_measurements = true;
PX4_INFO("registers");
// wait for a while to ensure the lidar is in a ready state
px4_usleep(50_ms);
for (uint8_t reg = 0; reg <= 0x67; reg++) {
uint8_t val = 0;
int ret = lidar_transfer(&reg, 1, &val, 1);
if (ret != OK) {
printf("%02" PRIx8 ":XX ", reg);
} else {
printf("%02" PRIx8 ":%02" PRIu8, reg, val);
}
if (reg % 16 == 15) {
printf("\n");
}
}
printf("\n");
_pause_measurements = false;
}
void
TFmini_i2c::process_raw_measure(uint16_t distance_raw, uint16_t strength_raw,uint16_t &output_distance_cm)
{
uint16_t strength = (strength_raw);
const uint16_t MAX_DIST_CM = 1200;
const uint16_t MIN_DIST_CM = 10;
output_distance_cm = (distance_raw);
if (strength < 100 || strength == 0xFFFF || output_distance_cm > MAX_DIST_CM) {
/*
* From manual: "when the signal strength is lower than 100 or equal to
* 65535, the detection is unreliable, TFmini Plus will set distance
* value to 0." - force it to the max distance so status is set to OutOfRangeHigh
* rather than NoData.
*/
output_distance_cm = MAX_DIST_CM + 100;
}
}
int
TFmini_i2c::collect()
{
perf_begin(_sample_perf);
uint8_t CMD_READ_MEASUREMENT[] = { 0x5A, 0x05, 0x00, 0x07, 0x66 };
union {
struct PACKED {
uint8_t header1;
uint8_t header2;
uint16_t distance;
uint16_t strength;
uint32_t timestamp;
uint8_t checksum;
} val;
uint8_t arr[11];
} u;
bool ret;
uint16_t distance;
ret = lidar_transfer(CMD_READ_MEASUREMENT, sizeof(CMD_READ_MEASUREMENT), nullptr, 0);
if (!ret || !lidar_transfer(nullptr, 0, (uint8_t *)&u, sizeof(u))) {
PX4_DEBUG("error reading from sensor: %d", ret);
perf_count(_comms_errors);
if (perf_event_count(_comms_errors) % 10 == 0) {
perf_count(_sensor_resets);
reset_sensor();
}
perf_end(_sample_perf);
return -EAGAIN;
}
if (u.val.header1 != 0x59 || u.val.header2 != 0x59 || !check_checksum(u.arr, sizeof(u)))
return -EAGAIN;
process_raw_measure(u.val.distance, u.val.strength, distance);
accum.sum += distance;
accum.count++;
const float distance_m = float(distance) * 1e-2f;
if (distance_m == 0) {
_zero_counter++;
if (_zero_counter == 20) {
/* we have had 20 zeros in a row - reset the
sensor. This is a known bad state of the
sensor where it returns 16 bits of zero for
the distance with a trailing NACK, and
keeps doing that even when the target comes
into a valid range.
*/
_zero_counter = 0;
perf_end(_sample_perf);
perf_count(_sensor_zero_resets);
return reset_sensor();
}
} else {
_zero_counter = 0;
}
// this should be fairly close to the end of the measurement, so the best approximation of the time
const hrt_abstime timestamp_sample = hrt_absolute_time();
_px4_rangefinder.update(timestamp_sample, distance_m);
perf_end(_sample_perf);
return OK;
#if 0
// read from the sensor
uint8_t val[2] {};
perf_begin(_sample_perf);
// read the high and low byte distance registers
uint8_t distance_reg = TFMINI_DISTHIGH_REG | TFMINI_AUTO_INCREMENT;
int ret = lidar_transfer(&distance_reg, 1, &val[0], sizeof(val));
// if the transfer failed or if the high bit of distance is
// set then the distance is invalid
if (ret < 0 || (val[0] & 0x80)) {
if (hrt_absolute_time() - _acquire_time_usec > TFMINI_CONVERSION_TIMEOUT) {
/*
NACKs from the sensor are expected when we
read before it is ready, so only consider it
an error if more than 100ms has elapsed.
*/
PX4_DEBUG("error reading from sensor: %d", ret);
perf_count(_comms_errors);
if (perf_event_count(_comms_errors) % 10 == 0) {
perf_count(_sensor_resets);
reset_sensor();
}
}
perf_end(_sample_perf);
// if we are getting lots of I2C transfer errors try
// resetting the sensor
return ret;
}
uint16_t distance_cm = (val[0] << 8) | val[1];
const float distance_m = float(distance_cm) * 1e-2f;
if (distance_cm == 0) {
_zero_counter++;
if (_zero_counter == 20) {
/* we have had 20 zeros in a row - reset the
sensor. This is a known bad state of the
sensor where it returns 16 bits of zero for
the distance with a trailing NACK, and
keeps doing that even when the target comes
into a valid range.
*/
_zero_counter = 0;
perf_end(_sample_perf);
perf_count(_sensor_zero_resets);
return reset_sensor();
}
} else {
_zero_counter = 0;
}
// this should be fairly close to the end of the measurement, so the best approximation of the time
const hrt_abstime timestamp_sample = hrt_absolute_time();
// Relative signal strength measurement, i.e. the strength of
// the main signal peak compared to the general noise level.
uint8_t signal_strength_reg = TFMINI_SIGNAL_STRENGTH_REG;
ret = lidar_transfer(&signal_strength_reg, 1, &val[0], 1);
// check if the transfer failed
if (ret < 0) {
if (hrt_elapsed_time(&_acquire_time_usec) > TFMINI_CONVERSION_TIMEOUT) {
/*
NACKs from the sensor are expected when we
read before it is ready, so only consider it
an error if more than 100ms has elapsed.
*/
PX4_INFO("signal strength read failed");
DEVICE_DEBUG("error reading signal strength from sensor: %d", ret);
perf_count(_comms_errors);
if (perf_event_count(_comms_errors) % 10 == 0) {
perf_count(_sensor_resets);
reset_sensor();
}
}
perf_end(_sample_perf);
// if we are getting lots of I2C transfer errors try
// resetting the sensor
return ret;
}
uint8_t TFMINI_signal_strength = val[0];
uint8_t signal_quality;
// We detect if V3HP is being used
if (_is_v3hp) {
//Normalize signal strength to 0...100 percent using the absolute signal strength.
signal_quality = 100 * math::max(TFMINI_signal_strength - TFMINI_SIGNAL_STRENGTH_MIN_V3HP, 0) /
(TFMINI_SIGNAL_STRENGTH_MAX_V3HP - TFMINI_SIGNAL_STRENGTH_MIN_V3HP);
} else {
// Absolute peak strength measurement, i.e. absolute strength of main signal peak.
uint8_t peak_strength_reg = TFMINI_PEAK_STRENGTH_REG;
ret = lidar_transfer(&peak_strength_reg, 1, &val[0], 1);
// check if the transfer failed
if (ret < 0) {
if (hrt_elapsed_time(&_acquire_time_usec) > TFMINI_CONVERSION_TIMEOUT) {
/*
NACKs from the sensor are expected when we
read before it is ready, so only consider it
an error if more than 100ms has elapsed.
*/
PX4_INFO("peak strength read failed");
DEVICE_DEBUG("error reading peak strength from sensor: %d", ret);
perf_count(_comms_errors);
if (perf_event_count(_comms_errors) % 10 == 0) {
perf_count(_sensor_resets);
reset_sensor();
}
}
perf_end(_sample_perf);
// if we are getting lots of I2C transfer errors try
// resetting the sensor
return ret;
}
uint8_t TFMINI_peak_strength = val[0];
// For v2 and v3 use TFMINI_signal_strength (a relative measure, i.e. peak strength to noise!) to reject potentially ambiguous measurements
if (TFMINI_signal_strength <= TFMINI_SIGNAL_STRENGTH_LOW || distance_m < TFMINI_MIN_DISTANCE) {
signal_quality = 0;
} else {
//Normalize signal strength to 0...100 percent using the absolute signal peak strength.
signal_quality = 100 * math::max(TFMINI_peak_strength - TFMINI_PEAK_STRENGTH_LOW, 0) /
(TFMINI_PEAK_STRENGTH_HIGH - TFMINI_PEAK_STRENGTH_LOW);
}
}
_px4_rangefinder.update(timestamp_sample, distance_m, signal_quality);
perf_end(_sample_perf);
return OK;
#endif
}
void TFmini_i2c::start()
{
// reset the report ring and state machine
_collect_phase = false;
// schedule a cycle to start things
ScheduleNow();
}
void TFmini_i2c::RunImpl()
{
// perform collection
if (collect() == -EAGAIN) {
// reschedule to grab the missing bits, time to transmit 9 bytes @ 115200 bps
ScheduleClear();
ScheduleOnInterval(7_ms, 87 * 9);
return;
}
/* schedule a fresh cycle call when the measurement is done */
ScheduleDelayed(TFMINI_CONVERSION_INTERVAL);
#if 0
/* collection phase? */
if (_collect_phase) {
/* try a collection */
if (OK != collect()) {
PX4_DEBUG("collection error");
/* if we've been waiting more than 200ms then
send a new acquire */
if (hrt_elapsed_time(&_acquire_time_usec) > (TFMINI_CONVERSION_TIMEOUT * 2)) {
_collect_phase = false;
}
} else {
/* next phase is measurement */
_collect_phase = false;
/*
* Is there a collect->measure gap?
*/
if (get_measure_interval() > TFMINI_CONVERSION_INTERVAL) {
/* schedule a fresh cycle call when we are ready to measure again */
ScheduleDelayed(get_measure_interval() - TFMINI_CONVERSION_INTERVAL);
return;
}
}
}
if (_collect_phase == false) {
/* measurement phase */
if (OK != measure()) {
PX4_DEBUG("measure error");
} else {
/* next phase is collection. Don't switch to
collection phase until we have a successful
acquire request I2C transfer */
_collect_phase = true;
}
}
/* schedule a fresh cycle call when the measurement is done */
ScheduleDelayed(TFMINI_CONVERSION_INTERVAL);
#endif
}

203
src/drivers/distance_sensor/tfmini_i2c/tfmini_i2c.h

@ -0,0 +1,203 @@ @@ -0,0 +1,203 @@
/****************************************************************************
*
* Copyright (c) 2014-2019 PX4 Development Team. All rights reserved.
*
* 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 PX4 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 OWNER 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.
*
****************************************************************************/
/**
* @file TFmini_i2c.h
* @author Allyson Kreft
*
* Driver for the PulsedLight Lidar-Lite range finders connected via I2C.
*/
#pragma once
#include <drivers/device/i2c.h>
#include <drivers/drv_hrt.h>
#include <mathlib/mathlib.h>
#include <px4_platform_common/defines.h>
#include <px4_platform_common/px4_work_queue/ScheduledWorkItem.hpp>
#include <px4_platform_common/i2c_spi_buses.h>
#include <drivers/device/device.h>
#include <lib/drivers/rangefinder/PX4Rangefinder.hpp>
#include <perf/perf_counter.h>
using namespace time_literals;
/* Configuration Constants */
static constexpr uint8_t TFMINI_BASEADDR = 0x10; /* 7-bit address */
static constexpr uint8_t TFMINI_BASEADDR_OLD = 0x10; /* 7-bit address */
static constexpr uint8_t TFMINI_SIG_COUNT_VAL_DEFAULT = 0x80; /* Default maximum acquisition count */
/* TFMINI Registers addresses */
static constexpr uint8_t TFMINI_MEASURE_REG = 0x00; /* Measure range register */
static constexpr uint8_t TFMINI_MSRREG_RESET = 0x00; /* reset to power on defaults */
static constexpr uint8_t TFMINI_MSRREG_ACQUIRE = 0x04; /* Value to acquire a measurement, version specific */
static constexpr uint8_t TFMINI_DISTHIGH_REG = 0x0F; /* High byte of distance register, auto increment */
static constexpr uint8_t TFMINI_AUTO_INCREMENT = 0x80;
static constexpr uint8_t TFMINI_HW_VERSION = 0x41;
static constexpr uint8_t TFMINI_SW_VERSION = 0x4f;
static constexpr uint8_t TFMINI_SIGNAL_STRENGTH_REG = 0x0e;
static constexpr uint8_t TFMINI_PEAK_STRENGTH_REG = 0x0c;
static constexpr uint8_t TFMINI_UNIT_ID_HIGH = 0x16;
static constexpr uint8_t TFMINI_UNIT_ID_LOW = 0x17;
static constexpr uint8_t TFMINI_SIG_COUNT_VAL_REG = 0x02; /* Maximum acquisition count register */
static constexpr uint8_t TFMINI_SIG_COUNT_VAL_MAX = 0xFF; /* Maximum acquisition count max value */
static constexpr int TFMINI_SIGNAL_STRENGTH_MIN_V3HP = 70; /* Min signal strength for V3HP */
static constexpr int TFMINI_SIGNAL_STRENGTH_MAX_V3HP = 255; /* Max signal strength for V3HP */
static constexpr int TFMINI_SIGNAL_STRENGTH_LOW = 24; /* Minimum signal strength for a valid measurement */
static constexpr int TFMINI_PEAK_STRENGTH_LOW = 135; /* Minimum peak strength for accepting a measurement */
static constexpr int TFMINI_PEAK_STRENGTH_HIGH = 234; /* Max peak strength raw value */
static constexpr float TFMINI_MIN_DISTANCE{0.05f};
static constexpr float TFMINI_MAX_DISTANCE{12.00f};
static constexpr float TFMINI_MAX_DISTANCE_V2{35.00f};
// Normal conversion wait time.
static constexpr uint32_t TFMINI_CONVERSION_INTERVAL{50_ms};
// Maximum time to wait for a conversion to complete.
static constexpr uint32_t TFMINI_CONVERSION_TIMEOUT{100_ms};
class TFmini_i2c : public device::I2C, public I2CSPIDriver<TFmini_i2c>
{
public:
TFmini_i2c(I2CSPIBusOption bus_option, const int bus, const uint8_t orientation, int bus_frequency,
const int address = TFMINI_BASEADDR);
virtual ~TFmini_i2c();
static I2CSPIDriverBase *instantiate(const BusCLIArguments &cli, const BusInstanceIterator &iterator,
int runtime_instance);
static void print_usage();
int init();
/**
* Print sensor registers to console for debugging.
*/
void print_registers();
/**
* Initialise the automatic measurement state machine and start it.
*
* @note This function is called at open and error time. It might make sense
* to make it more aggressive about resetting the bus in case of errors.
*/
void start();
/**
* Perform a poll cycle; collect from the previous measurement
* and start a new one.
*/
void RunImpl();
protected:
void custom_method(const BusCLIArguments &cli) override;
void print_status() override;
uint32_t get_measure_interval() const { return TFMINI_CONVERSION_INTERVAL; };
int measure();
/**
* Reset the sensor to power on defaults plus additional configurations.
*/
int reset_sensor();
int probe() override;
int read_reg(const uint8_t reg, uint8_t &val);
int write_reg(const uint8_t reg, const uint8_t &val);
int check_checksum(uint8_t *arr, int pkt_len);
private:
int collect();
/**
* LidarLite specific transfer function. This is needed
* to avoid a stop transition with SCL high
*
* @param send Pointer to bytes to send.
* @param send_len Number of bytes to send.
* @param recv Pointer to buffer for bytes received.
* @param recv_len Number of bytes to receive.
* @return OK if the transfer was successful, -errno
* otherwise.
*/
int lidar_transfer(const uint8_t *send, const unsigned send_len, uint8_t *recv, const unsigned recv_len);
/**
* Test whether the device supported by the driver is present at a
* specific address.
*
* @param address The I2C bus address to probe.
* @return True if the device is present.
*/
int probe_address(const uint8_t address);
bool _collect_phase{false};
bool _is_v3hp{false};
bool _pause_measurements{false};
uint8_t _hw_version{0};
uint8_t _sw_version{0};
uint16_t _unit_id{0};
uint16_t _zero_counter{0};
uint64_t _acquire_time_usec{0};
PX4Rangefinder _px4_rangefinder;
perf_counter_t _comms_errors{perf_alloc(PC_COUNT, "TFMINI: comms errors")};
perf_counter_t _sample_perf{perf_alloc(PC_ELAPSED, "TFMINI: read")};
perf_counter_t _sensor_resets{perf_alloc(PC_COUNT, "TFMINI: resets")};
perf_counter_t _sensor_zero_resets{perf_alloc(PC_COUNT, "TFMINI: zero resets")};
void process_raw_measure(uint16_t distance_raw, uint16_t strength_raw,uint16_t &output_distance_cm);
struct {
uint32_t sum;
uint32_t count;
} accum;
};

142
src/drivers/distance_sensor/tfmini_i2c/tfmini_i2c_main.cpp

@ -0,0 +1,142 @@ @@ -0,0 +1,142 @@
/****************************************************************************
*
* Copyright (c) 2014-2019 PX4 Development Team. All rights reserved.
*
* 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 PX4 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 OWNER 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.
*
****************************************************************************/
/**
* @file tfmini_i2c_main.cpp
* @author Allyson Kreft
* @author Johan Jansen <jnsn.johan@gmail.com>
* @author Ban Siesta <bansiesta@gmail.com>
* @author James Goppert <james.goppert@gmail.com>
*
*/
#include <board_config.h>
#include <px4_platform_common/getopt.h>
#include <px4_platform_common/module.h>
#include "tfmini_i2c.h"
void
TFmini_i2c::print_usage()
{
PRINT_MODULE_DESCRIPTION(
R"DESCR_STR(
### Description
I2C bus driver for LidarLite rangefinders.
The sensor/driver must be enabled using the parameter SENS_EN_LL40LS.
Setup/usage information: https://docs.px4.io/master/en/sensor/lidar_lite.html
)DESCR_STR");
PRINT_MODULE_USAGE_NAME("tfmini_i2c_main", "driver");
PRINT_MODULE_USAGE_SUBCATEGORY("distance_sensor");
PRINT_MODULE_USAGE_COMMAND("start");
PRINT_MODULE_USAGE_PARAMS_I2C_SPI_DRIVER(true, false);
PRINT_MODULE_USAGE_PARAM_INT('R', 25, 0, 25, "Sensor rotation - forward facing by default", true);
PRINT_MODULE_USAGE_COMMAND("regdump");
PRINT_MODULE_USAGE_DEFAULT_COMMANDS();
}
I2CSPIDriverBase *TFmini_i2c::instantiate(const BusCLIArguments &cli, const BusInstanceIterator &iterator,
int runtime_instance)
{
// 类实例,传入BusInstanceIterator总线实例迭代器参数,解析 CLI 参数
printf("instantiate: bus:%d,ori:%d,freq:%d \n", iterator.bus(), cli.orientation, cli.bus_frequency);
TFmini_i2c* instance = new TFmini_i2c(iterator.configuredBusOption(), iterator.bus(), cli.orientation, cli.bus_frequency);
if (instance == nullptr) {
PX4_ERR("alloc failed");
return nullptr;
}
if (instance->init() != PX4_OK) {
delete instance;
return nullptr;
}
instance->start();
return instance;
}
void
TFmini_i2c::custom_method(const BusCLIArguments &cli)
{
print_registers();
}
extern "C" __EXPORT int tfmini_i2c_main(int argc, char *argv[])
{
int ch;
using ThisDriver = TFmini_i2c;
BusCLIArguments cli{true, false};
cli.orientation = distance_sensor_s::ROTATION_FORWARD_FACING;
cli.default_i2c_frequency = 400000;
while ((ch = cli.getOpt(argc, argv, "R:")) != EOF) {
switch (ch) {
case 'R':
cli.orientation = (enum Rotation)atoi(cli.optArg());
break;
}
}
const char *verb = cli.optArg();
if (!verb) {
ThisDriver::print_usage();
return -1;
}
BusInstanceIterator iterator(MODULE_NAME, cli, DRV_DIST_DEVTYPE_TFMINI_I2C);
if (!strcmp(verb, "start")) {
printf("%s,cli: drv:%d,ori:%d,freq:%d \n",__FILE__, DRV_DIST_DEVTYPE_TFMINI_I2C, cli.orientation, cli.default_i2c_frequency);
return ThisDriver::module_start(cli, iterator);
}
if (!strcmp(verb, "stop")) {
return ThisDriver::module_stop(iterator);
}
if (!strcmp(verb, "status")) {
return ThisDriver::module_status(iterator);
}
if (!strcmp(verb, "regdump")) {
return ThisDriver::module_custom_method(cli, iterator);
}
ThisDriver::print_usage();
return -1;
}

2
src/drivers/drv_sensor.h

@ -195,6 +195,8 @@ @@ -195,6 +195,8 @@
#define DRV_GPS_DEVTYPE_SIM 0xAF
#define DRV_DIST_DEVTYPE_TFMINI_I2C 0xB0
#define DRV_DEVTYPE_UNUSED 0xff

99
src/drivers/lights/rgbled_ncp5623c/rgbled_ncp5623c.cpp

@ -34,7 +34,8 @@ @@ -34,7 +34,8 @@
/**
* @file rgbled_ncp5623c.cpp
*
* Driver for the onboard RGB LED controller (NCP5623C) connected via I2C.
* Driver for the onboard RGB LED controller (NCP5623B or NCP5623C)
* connected via I2C.
*
* @author CUAVcaijie <caijie@cuav.net>
*/
@ -52,21 +53,22 @@ @@ -52,21 +53,22 @@
using namespace time_literals;
#define ADDR 0x39 /**< I2C adress of NCP5623C */
#define NCP5623B_ADDR 0x38 /**< I2C address of NCP5623B */
#define NCP5623C_ADDR 0x39 /**< I2C address of NCP5623C */
#define NCP5623_LED_CURRENT 0x20 /**< Current register */
#define NCP5623_LED_PWM0 0x40 /**< pwm0 register */
#define NCP5623_LED_PWM1 0x60 /**< pwm1 register */
#define NCP5623_LED_PWM2 0x80 /**< pwm2 register */
#define NCP5623_LED_CURRENT 0x20 /**< Current register */
#define NCP5623_LED_PWM0 0x40 /**< pwm0 register */
#define NCP5623_LED_PWM1 0x60 /**< pwm1 register */
#define NCP5623_LED_PWM2 0x80 /**< pwm2 register */
#define NCP5623_LED_BRIGHT 0x1f /**< full brightness */
#define NCP5623_LED_OFF 0x00 /**< off */
#define NCP5623_LED_BRIGHT 0x1f /**< full brightness */
#define NCP5623_LED_OFF 0x00 /**< off */
class RGBLED_NCP5623C : public device::I2C, public I2CSPIDriver<RGBLED_NCP5623C>
{
public:
RGBLED_NCP5623C(I2CSPIBusOption bus_option, const int bus, int bus_frequency, const int address);
RGBLED_NCP5623C(I2CSPIBusOption bus_option, const int bus, int bus_frequency, const int address, const int order);
virtual ~RGBLED_NCP5623C() = default;
static I2CSPIDriverBase *instantiate(const BusCLIArguments &cli, const BusInstanceIterator &iterator,
@ -77,15 +79,20 @@ public: @@ -77,15 +79,20 @@ public:
int probe() override;
void RunImpl();
virtual int8_t get_i2c_address() {return get_device_address();}
private:
int send_led_rgb();
void update_params();
int write(uint8_t reg, uint8_t data);
float _brightness{1.0f};
float _max_brightness{1.0f};
uint8_t _r{0};
uint8_t _g{0};
uint8_t _b{0};
uint8_t _r{0};
uint8_t _g{0};
uint8_t _b{0};
volatile bool _running{false};
volatile bool _should_run{true};
bool _leds_enabled{true};
@ -94,16 +101,40 @@ private: @@ -94,16 +101,40 @@ private:
LedController _led_controller;
int send_led_rgb();
void update_params();
int write(uint8_t reg, uint8_t data);
uint8_t _red{NCP5623_LED_PWM0};
uint8_t _green{NCP5623_LED_PWM1};
uint8_t _blue{NCP5623_LED_PWM2};
};
RGBLED_NCP5623C::RGBLED_NCP5623C(I2CSPIBusOption bus_option, const int bus, int bus_frequency, const int address) :
RGBLED_NCP5623C::RGBLED_NCP5623C(I2CSPIBusOption bus_option, const int bus, int bus_frequency, const int address,
const int order) :
I2C(DRV_LED_DEVTYPE_RGBLED_NCP5623C, MODULE_NAME, bus, address, bus_frequency),
I2CSPIDriver(MODULE_NAME, px4::device_bus_to_wq(get_device_id()), bus_option, bus, address)
{
int ordering = order;
// ordering is RGB: Hundreds is Red, Tens is green and ones is Blue
// 123 would drive the
// R LED from = NCP5623_LED_PWM0
// G LED from = NCP5623_LED_PWM1
// B LED from = NCP5623_LED_PWM2
// 321 would drive the
// R LED from = NCP5623_LED_PWM2
// G LED from = NCP5623_LED_PWM1
// B LED from = NCP5623_LED_PWM0
const uint8_t sig[] = {NCP5623_LED_PWM0, NCP5623_LED_PWM1, NCP5623_LED_PWM2};
// Process ordering in lsd to msd order.(BGR)
uint8_t *color[] = {&_blue, &_green, &_red };
unsigned int s = 0;
for (unsigned int i = 0; i < arraySize(color); i++) {
s = (ordering % 10) - 1;
if (s < arraySize(sig)) {
*color[i] = sig[s];
}
ordering /= 10;
}
}
int
@ -138,9 +169,15 @@ RGBLED_NCP5623C::init() @@ -138,9 +169,15 @@ RGBLED_NCP5623C::init()
int
RGBLED_NCP5623C::probe()
{
_retries = 4;
_retries = 2;
int status = write(NCP5623_LED_CURRENT, NCP5623_LED_OFF);
if (status == PX4_ERROR) {
set_device_address(NCP5623B_ADDR);
status = write(NCP5623_LED_CURRENT, NCP5623_LED_OFF);
}
return write(NCP5623_LED_CURRENT, 0x00);
return status;
}
void
@ -212,14 +249,13 @@ RGBLED_NCP5623C::RunImpl() @@ -212,14 +249,13 @@ RGBLED_NCP5623C::RunImpl()
int
RGBLED_NCP5623C::send_led_rgb()
{
uint8_t msg[7] = {0x20, 0x70, 0x40, 0x70, 0x60, 0x70, 0x80};
uint8_t brightness = 0x1f * _max_brightness;
msg[0] = NCP5623_LED_CURRENT | (brightness & 0x1f);
msg[2] = NCP5623_LED_PWM0 | (uint8_t(_r * _brightness) & 0x1f);
msg[4] = NCP5623_LED_PWM1 | (uint8_t(_g * _brightness) & 0x1f);
msg[6] = NCP5623_LED_PWM2 | (uint8_t(_b * _brightness) & 0x1f);
msg[2] = _red | (uint8_t(_r * _brightness) & 0x1f);
msg[4] = _green | (uint8_t(_g * _brightness) & 0x1f);
msg[6] = _blue | (uint8_t(_b * _brightness) & 0x1f);
return transfer(&msg[0], 7, nullptr, 0);
}
@ -246,6 +282,7 @@ RGBLED_NCP5623C::print_usage() @@ -246,6 +282,7 @@ RGBLED_NCP5623C::print_usage()
PRINT_MODULE_USAGE_COMMAND("start");
PRINT_MODULE_USAGE_PARAMS_I2C_SPI_DRIVER(true, false);
PRINT_MODULE_USAGE_PARAMS_I2C_ADDRESS(0x39);
PRINT_MODULE_USAGE_PARAM_INT('o', 123, 123, 321, "RGB PWM Assignment", true);
PRINT_MODULE_USAGE_DEFAULT_COMMANDS();
}
@ -253,7 +290,7 @@ I2CSPIDriverBase *RGBLED_NCP5623C::instantiate(const BusCLIArguments &cli, const @@ -253,7 +290,7 @@ I2CSPIDriverBase *RGBLED_NCP5623C::instantiate(const BusCLIArguments &cli, const
int runtime_instance)
{
RGBLED_NCP5623C *instance = new RGBLED_NCP5623C(iterator.configuredBusOption(), iterator.bus(), cli.bus_frequency,
cli.i2c_address);
cli.i2c_address, cli.custom1);
if (instance == nullptr) {
PX4_ERR("alloc failed");
@ -273,9 +310,19 @@ extern "C" __EXPORT int rgbled_ncp5623c_main(int argc, char *argv[]) @@ -273,9 +310,19 @@ extern "C" __EXPORT int rgbled_ncp5623c_main(int argc, char *argv[])
using ThisDriver = RGBLED_NCP5623C;
BusCLIArguments cli{true, false};
cli.default_i2c_frequency = 100000;
cli.i2c_address = ADDR;
cli.i2c_address = NCP5623C_ADDR;
cli.custom1 = 123;
int ch;
while ((ch = cli.getOpt(argc, argv, "o:")) != EOF) {
switch (ch) {
case 'o':
cli.custom1 = atoi(cli.optArg());
break;
}
}
const char *verb = cli.parseDefaultArguments(argc, argv);
const char *verb = cli.optArg();
if (!verb) {
ThisDriver::print_usage();

6
src/drivers/magnetometer/hmc5883/hmc5883_i2c.cpp

@ -39,10 +39,13 @@ @@ -39,10 +39,13 @@
#include <px4_platform_common/px4_config.h>
#include <drivers/device/i2c.h>
#include <px4_platform_common/getopt.h>
#include <px4_platform_common/module.h>
#include "hmc5883.h"
#define HMC5883L_ADDRESS 0x1E
// #define HMC5883L_ADDRESS 0x11
device::Device *HMC5883_I2C_interface(int bus, int bus_frequency);
@ -72,6 +75,7 @@ HMC5883_I2C::HMC5883_I2C(int bus, int bus_frequency) : @@ -72,6 +75,7 @@ HMC5883_I2C::HMC5883_I2C(int bus, int bus_frequency) :
int HMC5883_I2C::probe()
{
printf("HMC5883_I2C: probe() \n");
uint8_t data[3] = {0, 0, 0};
_retries = 10;
@ -85,6 +89,8 @@ int HMC5883_I2C::probe() @@ -85,6 +89,8 @@ int HMC5883_I2C::probe()
_retries = 2;
printf("HMC5883 {%d} probe:%d,ori:%d,freq:%d \n",__LINE__, data[0],data[1],data[2]);
DEVICE_DEBUG("ID byte mismatch (%02x,%02x,%02x)", data[0], data[1], data[2]);
if ((data[0] != ID_A_WHO_AM_I) ||
(data[1] != ID_B_WHO_AM_I) ||
(data[2] != ID_C_WHO_AM_I)) {

3
src/drivers/magnetometer/hmc5883/hmc5883_main.cpp

@ -49,8 +49,10 @@ I2CSPIDriverBase *HMC5883::instantiate(const BusCLIArguments &cli, const BusInst @@ -49,8 +49,10 @@ I2CSPIDriverBase *HMC5883::instantiate(const BusCLIArguments &cli, const BusInst
int runtime_instance)
{
device::Device *interface = nullptr;
printf("HMC5883: bus:%d,ori:%d,freq:%d \n", iterator.bus(), cli.orientation, cli.bus_frequency);
if (iterator.busType() == BOARD_I2C_BUS) {
printf("HMC5883 {%d} bus:%d,ori:%d,freq:%d \n",__LINE__, iterator.bus(), cli.orientation, cli.bus_frequency);
interface = HMC5883_I2C_interface(iterator.bus(), cli.bus_frequency);
} else if (iterator.busType() == BOARD_SPI_BUS) {
@ -130,6 +132,7 @@ extern "C" int hmc5883_main(int argc, char *argv[]) @@ -130,6 +132,7 @@ extern "C" int hmc5883_main(int argc, char *argv[])
BusInstanceIterator iterator(MODULE_NAME, cli, DRV_MAG_DEVTYPE_HMC5883);
if (!strcmp(verb, "start")) {
printf("%s,cli: drv:%d,ori:%d,freq:%d \n",__FILE__, DRV_MAG_DEVTYPE_HMC5883, cli.orientation, cli.default_i2c_frequency);
return ThisDriver::module_start(cli, iterator);
}

2
src/drivers/magnetometer/vtrantech/vcm1193l/vcm1193l_main.cpp

@ -70,6 +70,8 @@ extern "C" int vcm1193l_main(int argc, char *argv[]) @@ -70,6 +70,8 @@ extern "C" int vcm1193l_main(int argc, char *argv[])
using ThisDriver = VCM1193L;
BusCLIArguments cli{true, false};
cli.default_i2c_frequency = I2C_SPEED;
cli.i2c_address = I2C_ADDRESS_DEFAULT;
while ((ch = cli.getOpt(argc, argv, "R:")) != EOF) {
switch (ch) {

2
src/lib/ecl

@ -1 +1 @@ @@ -1 +1 @@
Subproject commit 71fc1b81612fa9b5184d5abb93b69d109e9d0e4b
Subproject commit b3fed06fe822d08d19ab1d2c2f8daf7b7d21951c

14
src/lib/systemlib/system_params.c

@ -191,6 +191,20 @@ PARAM_DEFINE_INT32(SYS_CAL_TMIN, 5); @@ -191,6 +191,20 @@ PARAM_DEFINE_INT32(SYS_CAL_TMIN, 5);
*/
PARAM_DEFINE_INT32(SYS_CAL_TMAX, 10);
/**
* Control if the vehicle has a GPS
*
* Disable this if the system has no GPS.
* If disabled, the sensors hub will not process sensor_gps,
* and GPS will not be available for the rest of the system.
*
* @boolean
* @reboot_required true
*
* @group System
*/
PARAM_DEFINE_INT32(SYS_HAS_GPS, 1);
/**
* Control if the vehicle has a magnetometer
*

2
src/modules/ekf2/EKF2.cpp

@ -353,7 +353,7 @@ void EKF2::Run() @@ -353,7 +353,7 @@ void EKF2::Run()
}
} else {
const unsigned last_generation = _vehicle_imu_sub.get_last_generation();
const unsigned last_generation = _sensor_combined_sub.get_last_generation();
sensor_combined_s sensor_combined;
imu_updated = _sensor_combined_sub.update(&sensor_combined);

12
src/modules/flight_mode_manager/tasks/ManualAcceleration/FlightTaskManualAcceleration.cpp

@ -74,6 +74,18 @@ bool FlightTaskManualAcceleration::update() @@ -74,6 +74,18 @@ bool FlightTaskManualAcceleration::update()
_stick_acceleration_xy.getSetpoints(_position_setpoint, _velocity_setpoint, _acceleration_setpoint);
_constraints.want_takeoff = _checkTakeoff();
// check if an external yaw handler is active and if yes, let it update the yaw setpoints
if (_weathervane_yaw_handler && _weathervane_yaw_handler->is_active()) {
_yaw_setpoint = NAN;
// only enable the weathervane to change the yawrate when position lock is active (and thus the pos. sp. are NAN)
if (PX4_ISFINITE(_position_setpoint(0)) && PX4_ISFINITE(_position_setpoint(1))) {
// vehicle is steady
_yawspeed_setpoint += _weathervane_yaw_handler->get_weathervane_yawrate();
}
}
return ret;
}

7
src/modules/flight_mode_manager/tasks/ManualAcceleration/FlightTaskManualAcceleration.hpp

@ -52,10 +52,17 @@ public: @@ -52,10 +52,17 @@ public:
bool activate(const vehicle_local_position_setpoint_s &last_setpoint) override;
bool update() override;
/**
* Sets an external yaw handler which can be used to implement a different yaw control strategy.
*/
void setYawHandler(WeatherVane *yaw_handler) override { _weathervane_yaw_handler = yaw_handler; }
private:
StickAccelerationXY _stick_acceleration_xy;
StickYaw _stick_yaw;
void _ekfResetHandlerPositionXY() override;
void _ekfResetHandlerVelocityXY() override;
WeatherVane *_weathervane_yaw_handler{nullptr}; /**< external weathervane library, used to implement a yaw control law that turns the vehicle nose into the wind */
};

74
src/modules/mavlink/mavlink_receiver.cpp

@ -911,10 +911,12 @@ MavlinkReceiver::handle_message_set_position_target_local_ned(mavlink_message_t @@ -911,10 +911,12 @@ MavlinkReceiver::handle_message_set_position_target_local_ned(mavlink_message_t
(type_mask & POSITION_TARGET_TYPEMASK_VZ_IGNORE) ? 0.f : target_local_ned.vz
};
const matrix::Vector3f velocity_setpoint{R * velocity_body_sp};
setpoint.vx = velocity_setpoint(0);
setpoint.vy = velocity_setpoint(1);
setpoint.vz = velocity_setpoint(2);
const float yaw = matrix::Eulerf{R}(2);
setpoint.vx = cosf(yaw) * velocity_body_sp(0) - sinf(yaw) * velocity_body_sp(1);
setpoint.vy = sinf(yaw) * velocity_body_sp(0) + cosf(yaw) * velocity_body_sp(1);
setpoint.vz = velocity_body_sp(2);
} else {
setpoint.vx = NAN;
@ -2521,28 +2523,25 @@ MavlinkReceiver::handle_message_hil_state_quaternion(mavlink_message_t *msg) @@ -2521,28 +2523,25 @@ MavlinkReceiver::handle_message_hil_state_quaternion(mavlink_message_t *msg)
mavlink_hil_state_quaternion_t hil_state;
mavlink_msg_hil_state_quaternion_decode(msg, &hil_state);
const uint64_t timestamp = hrt_absolute_time();
const uint64_t timestamp_sample = hrt_absolute_time();
/* airspeed */
{
airspeed_s airspeed{};
airspeed.timestamp = timestamp;
airspeed.indicated_airspeed_m_s = hil_state.ind_airspeed * 1e-2f;
airspeed.true_airspeed_m_s = hil_state.true_airspeed * 1e-2f;
airspeed.air_temperature_celsius = 15.f;
airspeed.timestamp = hrt_absolute_time();
_airspeed_pub.publish(airspeed);
}
/* attitude */
{
vehicle_attitude_s hil_attitude{};
hil_attitude.timestamp = timestamp;
hil_attitude.timestamp_sample = timestamp_sample;
matrix::Quatf q(hil_state.attitude_quaternion);
q.copyTo(hil_attitude.q);
hil_attitude.timestamp = hrt_absolute_time();
_attitude_pub.publish(hil_attitude);
}
@ -2550,13 +2549,13 @@ MavlinkReceiver::handle_message_hil_state_quaternion(mavlink_message_t *msg) @@ -2550,13 +2549,13 @@ MavlinkReceiver::handle_message_hil_state_quaternion(mavlink_message_t *msg)
{
vehicle_global_position_s hil_global_pos{};
hil_global_pos.timestamp = timestamp;
hil_global_pos.timestamp_sample = timestamp_sample;
hil_global_pos.lat = hil_state.lat / ((double)1e7);
hil_global_pos.lon = hil_state.lon / ((double)1e7);
hil_global_pos.alt = hil_state.alt / 1000.0f;
hil_global_pos.eph = 2.0f;
hil_global_pos.epv = 4.0f;
hil_global_pos.eph = 2.f;
hil_global_pos.epv = 4.f;
hil_global_pos.timestamp = hrt_absolute_time();
_global_pos_pub.publish(hil_global_pos);
}
@ -2565,32 +2564,31 @@ MavlinkReceiver::handle_message_hil_state_quaternion(mavlink_message_t *msg) @@ -2565,32 +2564,31 @@ MavlinkReceiver::handle_message_hil_state_quaternion(mavlink_message_t *msg)
const double lat = hil_state.lat * 1e-7;
const double lon = hil_state.lon * 1e-7;
map_projection_reference_s global_local_proj_ref;
map_projection_init(&global_local_proj_ref, lat, lon);
float global_local_alt0 = hil_state.alt / 1000.f;
if (!map_projection_initialized(&_global_local_proj_ref) || !PX4_ISFINITE(_global_local_alt0)) {
map_projection_init(&_global_local_proj_ref, lat, lon);
_global_local_alt0 = hil_state.alt / 1000.f;
}
float x = 0.0f;
float y = 0.0f;
map_projection_project(&global_local_proj_ref, lat, lon, &x, &y);
float x = 0.f;
float y = 0.f;
map_projection_project(&_global_local_proj_ref, lat, lon, &x, &y);
vehicle_local_position_s hil_local_pos{};
hil_local_pos.timestamp = timestamp;
hil_local_pos.ref_timestamp = global_local_proj_ref.timestamp;
hil_local_pos.ref_lat = math::degrees(global_local_proj_ref.lat_rad);
hil_local_pos.ref_lon = math::degrees(global_local_proj_ref.lon_rad);
hil_local_pos.ref_alt = global_local_alt0;
hil_local_pos.timestamp_sample = timestamp_sample;
hil_local_pos.ref_timestamp = _global_local_proj_ref.timestamp;
hil_local_pos.ref_lat = math::degrees(_global_local_proj_ref.lat_rad);
hil_local_pos.ref_lon = math::degrees(_global_local_proj_ref.lon_rad);
hil_local_pos.ref_alt = _global_local_alt0;
hil_local_pos.xy_valid = true;
hil_local_pos.z_valid = true;
hil_local_pos.v_xy_valid = true;
hil_local_pos.v_z_valid = true;
hil_local_pos.x = x;
hil_local_pos.y = y;
hil_local_pos.z = global_local_alt0 - hil_state.alt / 1000.0f;
hil_local_pos.vx = hil_state.vx / 100.0f;
hil_local_pos.vy = hil_state.vy / 100.0f;
hil_local_pos.vz = hil_state.vz / 100.0f;
hil_local_pos.z = _global_local_alt0 - hil_state.alt / 1000.f;
hil_local_pos.vx = hil_state.vx / 100.f;
hil_local_pos.vy = hil_state.vy / 100.f;
hil_local_pos.vz = hil_state.vz / 100.f;
matrix::Eulerf euler{matrix::Quatf(hil_state.attitude_quaternion)};
hil_local_pos.heading = euler.psi();
@ -2600,7 +2598,7 @@ MavlinkReceiver::handle_message_hil_state_quaternion(mavlink_message_t *msg) @@ -2600,7 +2598,7 @@ MavlinkReceiver::handle_message_hil_state_quaternion(mavlink_message_t *msg)
hil_local_pos.vz_max = INFINITY;
hil_local_pos.hagl_min = INFINITY;
hil_local_pos.hagl_max = INFINITY;
hil_local_pos.timestamp = hrt_absolute_time();
_local_pos_pub.publish(hil_local_pos);
}
@ -2618,7 +2616,7 @@ MavlinkReceiver::handle_message_hil_state_quaternion(mavlink_message_t *msg) @@ -2618,7 +2616,7 @@ MavlinkReceiver::handle_message_hil_state_quaternion(mavlink_message_t *msg)
if (_px4_accel != nullptr) {
// accel in mG
_px4_accel->set_scale(CONSTANTS_ONE_G / 1000.0f);
_px4_accel->update(timestamp, hil_state.xacc, hil_state.yacc, hil_state.zacc);
_px4_accel->update(timestamp_sample, hil_state.xacc, hil_state.yacc, hil_state.zacc);
}
}
@ -2634,20 +2632,18 @@ MavlinkReceiver::handle_message_hil_state_quaternion(mavlink_message_t *msg) @@ -2634,20 +2632,18 @@ MavlinkReceiver::handle_message_hil_state_quaternion(mavlink_message_t *msg)
}
if (_px4_gyro != nullptr) {
_px4_gyro->update(timestamp, hil_state.rollspeed, hil_state.pitchspeed, hil_state.yawspeed);
_px4_gyro->update(timestamp_sample, hil_state.rollspeed, hil_state.pitchspeed, hil_state.yawspeed);
}
}
/* battery status */
{
battery_status_s hil_battery_status{};
hil_battery_status.timestamp = timestamp;
hil_battery_status.voltage_v = 11.1f;
hil_battery_status.voltage_filtered_v = 11.1f;
hil_battery_status.current_a = 10.0f;
hil_battery_status.discharged_mah = -1.0f;
hil_battery_status.timestamp = hrt_absolute_time();
_battery_pub.publish(hil_battery_status);
}
}

3
src/modules/mavlink/mavlink_receiver.h

@ -342,6 +342,9 @@ private: @@ -342,6 +342,9 @@ private:
uint8_t _mom_switch_pos[MOM_SWITCH_COUNT] {};
uint16_t _mom_switch_state{0};
map_projection_reference_s _global_local_proj_ref{};
float _global_local_alt0{NAN};
hrt_abstime _last_utm_global_pos_com{0};
// Allocated if needed.

97
src/modules/px4iofirmware/mixer.cpp

@ -74,7 +74,7 @@ static volatile bool mixer_servos_armed = false; @@ -74,7 +74,7 @@ static volatile bool mixer_servos_armed = false;
static volatile bool should_arm = false;
static volatile bool should_arm_nothrottle = false;
static volatile bool should_always_enable_pwm = false;
static volatile bool in_mixer = false;
static volatile bool mix_failsafe = false;
static bool new_fmu_data = false;
static uint64_t last_fmu_update = 0;
@ -94,31 +94,22 @@ enum mixer_source { @@ -94,31 +94,22 @@ enum mixer_source {
static volatile mixer_source source;
static int mixer_callback(uintptr_t handle, uint8_t control_group, uint8_t control_index, float &control);
static int mixer_mix_threadsafe(float *outputs, volatile uint16_t *limits);
static int mixer_handle_text_create_mixer();
static void mixer_mix_failsafe();
static MixerGroup mixer_group;
int mixer_mix_threadsafe(float *outputs, volatile uint16_t *limits)
{
/* poor mans mutex */
if ((r_status_flags & PX4IO_P_STATUS_FLAGS_MIXER_OK) == 0) {
return 0;
}
in_mixer = true;
int mixcount = mixer_group.mix(&outputs[0], PX4IO_SERVO_COUNT);
*limits = mixer_group.get_saturation_status();
in_mixer = false;
return mixcount;
}
void
mixer_tick()
{
/* check if the mixer got modified */
mixer_handle_text_create_mixer();
if (mix_failsafe) {
mixer_mix_failsafe();
mix_failsafe = false;
}
/* check that we are receiving fresh data from the FMU */
irqstate_t irq_flags = enter_critical_section();
const hrt_abstime fmu_data_received_time = system_state.fmu_data_received_time;
@ -314,7 +305,13 @@ mixer_tick() @@ -314,7 +305,13 @@ mixer_tick()
}
/* mix */
mixed = mixer_mix_threadsafe(&outputs[0], &r_mixer_limits);
if ((r_status_flags & PX4IO_P_STATUS_FLAGS_MIXER_OK) != 0) {
mixed = mixer_group.mix(&outputs[0], PX4IO_SERVO_COUNT);
r_mixer_limits = mixer_group.get_saturation_status();
} else {
mixed = 0;
}
/* the pwm limit call takes care of out of band errors */
output_limit_calc(should_arm, should_arm_nothrottle, mixed, r_setup_pwm_reverse, r_page_servo_disarmed,
@ -480,12 +477,7 @@ mixer_callback(uintptr_t handle, @@ -480,12 +477,7 @@ mixer_callback(uintptr_t handle,
}
/* limit output */
if (control > 1.0f) {
control = 1.0f;
} else if (control < -1.0f) {
control = -1.0f;
}
control = math::constrain(control, -1.f, 1.f);
/* motor spinup phase - lock throttle to zero */
if ((pwm_limit.state == OUTPUT_LIMIT_STATE_RAMP) || (should_arm_nothrottle && !should_arm)) {
@ -520,25 +512,26 @@ mixer_callback(uintptr_t handle, @@ -520,25 +512,26 @@ mixer_callback(uintptr_t handle,
static char mixer_text[PX4IO_MAX_MIXER_LENGTH]; /* large enough for one mixer */
static unsigned mixer_text_length = 0;
static bool mixer_update_pending = false;
static volatile bool mixer_update_pending = false;
static volatile bool mixer_reset_pending = false;
int
mixer_handle_text_create_mixer()
{
/* only run on update */
if (!mixer_update_pending) {
return 0;
}
/* do not allow a mixer change while safety off and FMU armed */
if ((r_status_flags & PX4IO_P_STATUS_FLAGS_SAFETY_OFF) &&
(r_setup_arming & PX4IO_P_SETUP_ARMING_FMU_ARMED)) {
return 1;
}
/* abort if we're in the mixer - it will be tried again in the next iteration */
if (in_mixer) {
return 1;
if (mixer_reset_pending) {
mixer_group.reset();
mixer_reset_pending = false;
}
/* only run on update */
if (!mixer_update_pending || (mixer_text_length == 0)) {
return 0;
}
/* process the text buffer, adding new mixers as their descriptions can be parsed */
@ -562,11 +555,13 @@ mixer_handle_text_create_mixer() @@ -562,11 +555,13 @@ mixer_handle_text_create_mixer()
mixer_update_pending = false;
update_trims = true;
update_mc_thrust_param = true;
return 0;
}
int
mixer_handle_text(const void *buffer, size_t length)
int interrupt_mixer_handle_text(const void *buffer, size_t length)
{
/* do not allow a mixer change while safety off and FMU armed */
if ((r_status_flags & PX4IO_P_STATUS_FLAGS_SAFETY_OFF) &&
@ -577,16 +572,7 @@ mixer_handle_text(const void *buffer, size_t length) @@ -577,16 +572,7 @@ mixer_handle_text(const void *buffer, size_t length)
/* disable mixing, will be enabled once load is complete */
atomic_modify_clear(&r_status_flags, PX4IO_P_STATUS_FLAGS_MIXER_OK);
/* set the update flags to dirty so we reload those values after a mixer change */
update_trims = true;
update_mc_thrust_param = true;
/* abort if we're in the mixer - the caller is expected to retry */
if (in_mixer) {
return 1;
}
px4io_mixdata *msg = (px4io_mixdata *)buffer;
px4io_mixdata *msg = (px4io_mixdata *)buffer;
isr_debug(2, "mix txt %u", length);
@ -601,7 +587,7 @@ mixer_handle_text(const void *buffer, size_t length) @@ -601,7 +587,7 @@ mixer_handle_text(const void *buffer, size_t length)
isr_debug(2, "reset");
/* THEN actually delete it */
mixer_group.reset();
mixer_reset_pending = true;
mixer_text_length = 0;
/* FALLTHROUGH */
@ -634,14 +620,18 @@ mixer_handle_text(const void *buffer, size_t length) @@ -634,14 +620,18 @@ mixer_handle_text(const void *buffer, size_t length)
return 0;
}
void interrupt_mixer_set_failsafe()
{
mix_failsafe = true;
}
void
mixer_set_failsafe()
mixer_mix_failsafe()
{
/*
* Check if a custom failsafe value has been written,
* or if the mixer is not ok and bail out.
*/
if ((r_setup_arming & PX4IO_P_SETUP_ARMING_FAILSAFE_CUSTOM) ||
!(r_status_flags & PX4IO_P_STATUS_FLAGS_MIXER_OK)) {
return;
@ -670,19 +660,22 @@ mixer_set_failsafe() @@ -670,19 +660,22 @@ mixer_set_failsafe()
}
/* mix */
mixed = mixer_mix_threadsafe(&outputs[0], &r_mixer_limits);
if ((r_status_flags & PX4IO_P_STATUS_FLAGS_MIXER_OK) != 0) {
mixed = mixer_group.mix(&outputs[0], PX4IO_SERVO_COUNT);
r_mixer_limits = mixer_group.get_saturation_status();
} else {
mixed = 0;
}
/* scale to PWM and update the servo outputs as required */
for (unsigned i = 0; i < mixed; i++) {
/* scale to servo output */
r_page_servo_failsafe[i] = (outputs[i] * 600.0f) + 1500;
}
/* disable the rest of the outputs */
for (unsigned i = mixed; i < PX4IO_SERVO_COUNT; i++) {
r_page_servo_failsafe[i] = 0;
}
}

5
src/modules/px4iofirmware/px4io.h

@ -193,10 +193,9 @@ void atomic_modify_and(volatile uint16_t *target, uint16_t modification); @@ -193,10 +193,9 @@ void atomic_modify_and(volatile uint16_t *target, uint16_t modification);
* Mixer
*/
extern void mixer_tick(void);
extern int mixer_handle_text_create_mixer(void);
extern int mixer_handle_text(const void *buffer, size_t length);
extern int interrupt_mixer_handle_text(const void *buffer, size_t length);
/* Set the failsafe values of all mixed channels (based on zero throttle, controls centered) */
extern void mixer_set_failsafe(void);
extern void interrupt_mixer_set_failsafe(void);
/**
* Safety switch/LED.

5
src/modules/px4iofirmware/registers.c

@ -461,7 +461,7 @@ registers_set(uint8_t page, uint8_t offset, const uint16_t *values, unsigned num @@ -461,7 +461,7 @@ registers_set(uint8_t page, uint8_t offset, const uint16_t *values, unsigned num
* this state defines an active system. This check is done in the
* text handling function.
*/
return mixer_handle_text(values, num_values * sizeof(*values));
return interrupt_mixer_handle_text(values, num_values * sizeof(*values));
default:
@ -514,9 +514,8 @@ registers_set_one(uint8_t page, uint8_t offset, uint16_t value) @@ -514,9 +514,8 @@ registers_set_one(uint8_t page, uint8_t offset, uint16_t value)
}
if (PX4IO_P_STATUS_FLAGS_MIXER_OK & r_status_flags) {
/* update failsafe values, now that the mixer is set to ok */
mixer_set_failsafe();
interrupt_mixer_set_failsafe();
}
break;

21
src/modules/sensors/sensors.cpp

@ -219,6 +219,7 @@ private: @@ -219,6 +219,7 @@ private:
DEFINE_PARAMETERS(
(ParamBool<px4::params::SYS_HAS_BARO>) _param_sys_has_baro,
(ParamBool<px4::params::SYS_HAS_GPS>) _param_sys_has_gps,
(ParamBool<px4::params::SYS_HAS_MAG>) _param_sys_has_mag,
(ParamBool<px4::params::SENS_IMU_MODE>) _param_sens_imu_mode
)
@ -534,12 +535,10 @@ void Sensors::InitializeVehicleAirData() @@ -534,12 +535,10 @@ void Sensors::InitializeVehicleAirData()
{
if (_param_sys_has_baro.get()) {
if (_vehicle_air_data == nullptr) {
if (orb_exists(ORB_ID(sensor_baro), 0) == PX4_OK) {
_vehicle_air_data = new VehicleAirData();
_vehicle_air_data = new VehicleAirData();
if (_vehicle_air_data) {
_vehicle_air_data->Start();
}
if (_vehicle_air_data) {
_vehicle_air_data->Start();
}
}
}
@ -547,8 +546,8 @@ void Sensors::InitializeVehicleAirData() @@ -547,8 +546,8 @@ void Sensors::InitializeVehicleAirData()
void Sensors::InitializeVehicleGPSPosition()
{
if (_vehicle_gps_position == nullptr) {
if (orb_exists(ORB_ID(sensor_gps), 0) == PX4_OK) {
if (_param_sys_has_gps.get()) {
if (_vehicle_gps_position == nullptr) {
_vehicle_gps_position = new VehicleGPSPosition();
if (_vehicle_gps_position) {
@ -602,12 +601,10 @@ void Sensors::InitializeVehicleMagnetometer() @@ -602,12 +601,10 @@ void Sensors::InitializeVehicleMagnetometer()
{
if (_param_sys_has_mag.get()) {
if (_vehicle_magnetometer == nullptr) {
if (orb_exists(ORB_ID(sensor_mag), 0) == PX4_OK) {
_vehicle_magnetometer = new VehicleMagnetometer();
_vehicle_magnetometer = new VehicleMagnetometer();
if (_vehicle_magnetometer) {
_vehicle_magnetometer->Start();
}
if (_vehicle_magnetometer) {
_vehicle_magnetometer->Start();
}
}
}

5
src/modules/sensors/voted_sensors_update.cpp

@ -187,6 +187,8 @@ void VotedSensorsUpdate::imuPoll(struct sensor_combined_s &raw) @@ -187,6 +187,8 @@ void VotedSensorsUpdate::imuPoll(struct sensor_combined_s &raw)
// find the best sensor
int accel_best_index = -1;
int gyro_best_index = -1;
_accel.voter.get_best(hrt_absolute_time(), &accel_best_index);
_gyro.voter.get_best(hrt_absolute_time(), &gyro_best_index);
if (!_param_sens_imu_mode.get() && ((_selection.timestamp != 0) || (_sensor_selection_sub.updated()))) {
// use sensor_selection to find best
@ -213,9 +215,6 @@ void VotedSensorsUpdate::imuPoll(struct sensor_combined_s &raw) @@ -213,9 +215,6 @@ void VotedSensorsUpdate::imuPoll(struct sensor_combined_s &raw)
} else {
// use sensor voter to find best if SENS_IMU_MODE is enabled or ORB_ID(sensor_selection) has never published
_accel.voter.get_best(hrt_absolute_time(), &accel_best_index);
_gyro.voter.get_best(hrt_absolute_time(), &gyro_best_index);
checkFailover(_accel, "Accel");
checkFailover(_gyro, "Gyro");
}

8
upload_fmuv3.sh

@ -0,0 +1,8 @@ @@ -0,0 +1,8 @@
date -R
starttime=`date +'%Y-%m-%d %H:%M:%S'`
make px4_fmu-v3_default upload
endtime=`date +'%Y-%m-%d %H:%M:%S'`
date -R
start_seconds=$(date --date="$starttime" +%s);
end_seconds=$(date --date="$endtime" +%s);
echo "本次运行时间: "$((end_seconds-start_seconds))"s"
Loading…
Cancel
Save