Dev Call Aug 21, 2023

Issues & Pull requests

Plane

Copter

Attendee count (max): 13

UTC2300 - GCS_MAVLink: home position should always send by magicrub · Pull Request #23636 · ArduPilot/ardupilot · GitHub

  • Changes requested

UTC2306 - https://github.com/ArduPilot/ardupilot/pull/24549

  • Initial implementation of an external control library
  • Randy will review this
  • For DDS control
  • merge-on-CI-pass!

UTC2307 - build_options.py: create MAVLink section, populate it by peterbarker · Pull Request #24587 · ArduPilot/ardupilot · GitHub

  • Creates a mavlink section to build_options.py and adds several things to it
  • Merged!
    Will allow people to turn things back on which we want to remove

UTC2310 - AP_RPM: Allow more instances by magicrub · Pull Request #24645 · ArduPilot/ardupilot · GitHub

  • More RPM instances
  • Not being logged after this is merged
    • Need to change logging to be an instance variable
  • Why 9?!
    • Octoplane with a forward motor
    • How’s the data coming in?
      • GPIO pins.
        • Lots of GPIO pins
  • 4.5 might be very breaking for things
    • E.g. changing RAW_IMU to have an instance variable,

UTC2319 - WIP: DDS external odometry/localization support by Ryanf55 · Pull Request #24518 · ArduPilot/ardupilot · GitHub

  • External odometry/localisation support for DDS
  • Should change visual odom to be double or single depending on target
  • Rates and velocities are single precision on CubeBlack, positions are double

UTC2331 - hwdef: removed baro from HolybroG4_GPS by tridge · Pull Request #24652 · ArduPilot/ardupilot · GitHub

  • Remove baro from HolyBroG4_GPS
    • Not on production units
    • Also turns off the IMUs
  • Users really want to flash the bootloader after they’ve flashed this firmware!
  • Boards are shipped with the flash in a weird state where it is all ff’s but can’t be written to
  • This patch forces erase of all sectors
  • There’s also a bug around flashing of these boards which the new bootloader works around
  • Great GPS, ‘though

UTC2337 - AP_BattMonitor: Fwd battery data to ESC_Telem by magicrub · Pull Request #24658 · ArduPilot/ardupilot · GitHub

  • Forward battery data to ESC telem
  • Peripheral use case
  • Allows you to bundle voltages from separate sensors into

UTC2343 - Plane:prevent compass-less plane AHRS warning on ground by Hwurzburg · Pull Request #24673 · ArduPilot/ardupilot · GitHub

  • Prevent compass-less plane
  • Would suppress compass warnings when it shouldn’t do that
  • Would also suppress if compass has failed
  • Special EKF state of waiting-for-movement
    • Need to get flag all the way up to this code….
  • Tridge will discuss with Henry some more

UTC2346 - AP_AHRS: return estimates from state structure by tridge · Pull Request #24675 · ArduPilot/ardupilot · GitHub

  • Return estimates from state structure
  • Faster
  • Might save a bunch of CPU
    • Re-evaluates active EKF type on each call
  • Shouldn’t change behaviour
  • Narrow semaphore scope?
    • Taking it during EKF update
    • Can just do it for copying the structure at the end in a future PR
  • Use an event to trigger the PID updates when new data comes in
    • Active IMU finishes filtering step and would then trigger the rate loops
  • 59 AM]Peter Hall: I would think there would also be a nice benefit on everything.
  • [9:59 AM]Peter Hall: Tuneing should be quite a bit easyer.
  • [10:02 AM]Peter Hall: PID updates should be run a on the IMU threads, so we use the new value immediately.
  • [10:04 AM]Leonard: The PID design was done with this in mind. This is one of the reasons for the T filter.
  • Reduce main loop rate to 200Hz?
    • But run PIDs at 4kHz

UTC0004 - Pass mavlink_message_t to handle_command_*_packet by peterbarker · Pull Request #24679 · ArduPilot/ardupilot · GitHub

  • Single switch statement for all of the mavlink message handling
    • So instead of some messages handled using msg and command just have them all take msg/command

UTC0011 - AP_MotorsUGV: add handling of asymmetric thrust by Williangalvani · Pull Request #24239 · ArduPilot/ardupilot · GitHub

  • Add handling of asymmetric thrust in AP_MotorsUGV
  • Willian has tested it
  • One quirk - if you are in manual mode and back up and you’re running asymmetrical thrust 2 you will reach full thrust at half throttle

UTC0015 - hwdef: update BETAFPV-F405 hwdef and readme by Hwurzburg · Pull Request #24681 · ArduPilot/ardupilot · GitHub

  • Betafpv-f405 hwdef and readme
  • Need to get Andy a board

UTC0015 - Enforce pre-commit in ArduPilot by Ryanf55 · Pull Request #24683 · ArduPilot/ardupilot · GitHub

  • Enforce pre-commit in ArduPilot
  • Pre-commit is a Python framework intended to run cleanliness code
    • It will change commits as you are making them
    • Modifies the commits and asks you to add stuff
  • Should this be in the default environment?
  • Pre-commit is something that people opt into
    • Now we’re forcing it on everyone
  • “Pre-commit install” step?
    • Modifies your git configuration to add commit
  • Tridge will try it for a while
  • More likely we end up with code that meets requirements
    • Python change in autotest which doesn’t change our script tests
  • Will warn if you try to commit an executable file which doesn’t have a shebang line
  • Tridge tested
    • Installed “black”
    • Took a long time to run
    • Gave errors on random things
  • Once installed, this is on for all your branches
    • So if you try doing stuff on Copter 4.3 bad things happen
    • Ryan will look
  • Should definitely be opt-in for now

UTC0035 - Rover 4.2: add RC in driver for Navigator by Williangalvani · Pull Request #24459 · ArduPilot/ardupilot · GitHub

  • RC in driver for Navigator
  • Merged!

UTC0044 - AP_Networking: Delete entity class pointer by muramura · Pull Request #24685 · ArduPilot/ardupilot · GitHub

  • Delete bad object
  • Tridge thinks maybe a comment instead

UTC0050 - CAN: support more device types in SITL AP_Periph by tridge · Pull Request #24687 · ArduPilot/ardupilot · GitHub

  • Support more CAN devices in SITL
  • [10:52 AM]Peter Hall: does it do CAN the same as the SITL CAN stuff we had before?
  • [10:52 AM]Peter Hall: That did not work with WSL.
    • Will work after the next PR

UTC0051 - Allow multiple External AHRS GPS instances by Ryanf55 · Pull Request #24699 · ArduPilot/ardupilot · GitHub

  • Allow multiple external ahrs gps instances

UTC0105 - AP_Param: fixed parameter defaults array length handling by tridge · Pull Request #24708 · ArduPilot/ardupilot · GitHub

  • Fix multiple-parameter-file-parsing
  • merged!

UTC0107 - AP_HAL_ChibiOS: add 8 bi-directional dshot channels to KakuteH7-Wing by andyp1per · Pull Request #24714 · ArduPilot/ardupilot · GitHub

  • Bidirectional d-shot channels for KakuteH7-Wing
  • Merged!

UTC0108 - Use textual IDs for APJ_BOARD_ID in hwdef by peterbarker · Pull Request #24718 · ArduPilot/ardupilot · GitHub

  • Textual IDs for APJ_BOARD_ID
  • Want to see if we can remove these lines entirely

UTC0120 - Refactor microstrain to common library by Ryanf55 · Pull Request #24723 · ArduPilot/ardupilot · GitHub

  • Refactoring MicroStrain externalahrs
  • Multiple inheritance
    • We’ve shied away from this but probably OK here
  • Commit list will get cleaned up
  • Autotest suite covers stuff
  • Ryan might get a device to test

UTC0129 - Plane: stable 4.4.x issues list · Issue #15941 · ArduPilot/ardupilot · GitHub

  • Plane update
  • 4.4.0 went out
  • 4.3.8 sometime around Friday
  • New stable updates for older releases may become a pattern - for at least one back
  • Couple of commits ready for 4.4.1
  • Himark servo support in 4.4 will probably happen

UTC0032 - Copter/Rover-4.4.0 issues list · Issue #23192 · ArduPilot/ardupilot · GitHub

  • New 4.4.0 is going well
  • A bunch of items still requiring investigation
  • Rover spline support is coming next
    • L1 may need to go back in

UTC0036 - XFacta vote passed

  • New DevTeam member!
  • Still another vote outstanding….

UTC0037 - close

1 Like