You signed in with another tab or window. Reload to refresh your session.You signed out in another tab or window. Reload to refresh your session.You switched accounts on another tab or window. Reload to refresh your session.Dismiss alert
Per open group: The rand() function shall compute a
sequence of pseudo-random integers in the range
[0, {RAND_MAX}] with a period of at least 2^32
{RAND_MAX} Maximum value returned by rand();
at least 32767.
/* Maximum value returned by rand(). Must be a minimum of 32767. */
#define RAND_MAX INT_MAX
and
#define INT_MAX 2147483647](c6edf41) by davids5
🛠️ [mathlib Limits constexpr helpers don't use references (#11411) - fixes #11408
34d06e0 2019-02-05 Tully Foote - create plane_cam world 93159f3 2019-02-01 TSC21 - CMakeLists: install package.xml c5882f7 2019-01-31 Anthony Lamping - models: plane: split up, adding plane_cam 38fe49a 2019-02-01 TSC21 - Travis CI: do not pass user id env var to the container 0f1221b 2019-02-01 TSC21 - Travis CI: update Ubuntu container tags bab0de9 2019-01-31 Anthony Lamping - models: remove matrice 100 opt flow meshes 0efbe69 2019-01-23 Oleg Kalachev - Fix building on macOS](205b0d9) by dagar
🛠️ [mavlink: improve comments about message forwarding (#11323) This removes the confusing ugly magic number of 233 introduced as part
of https://github.com//pull/7670.
Also, the convoluted if is cleaned up using 3 separate bools with some
comments to explain what's going on.
Here's the Weekly Digest for PX4/Firmware:
ISSUES
Last week 57 issues were created.
Of these, 28 issues have been closed and 29 issues are still open.
OPEN ISSUES
💚 #11422 update px4 dev containers to 2019-02-09, by dagar
💚 #11421 update mavlink to latest with addr of packed fix, by dagar
💚 #11420 MC - Loops maneuvers when MPC_XY_CRUISE > MPC_XY_VEL_MAX, by BazookaJoe1900
💚 #11418 Add
virtual
specifier to updateParamsImpl definition in _DEFINE_PARAMETER_UPDATE_METHOD(...) macro definition, by mcsauder💚 #11417 PX4_ISFINITE use builtin everywhere, by dagar
💚 #11415 navigation.h mission_item_s doesn't need to be packed, by dagar
💚 #11412 refactor ecl ekf analysis, by JohannesBrand
💚 #11410 Compilation error for px4_fmu-v5_default: incompatible cast, by Hoeze
💚 #11407 update all submodules to PX4 forks, by dagar
💚 #11405 Exaggerated vibration when hovering with Solo gazebo simulation, by diegomrt
💚 #11402 Failsafe triggering in SITL, by ChrisHughes
💚 #11401 [DON'T MERGE] debug CI, by julianoes
💚 #11400 simulator in hardware, new module, by romain-chiap
💚 #11399 Dev traj fixes, by bresch
💚 #11397 px4_sitl_default temporarily disable lockstep scheduler, by dagar
💚 #11395 Pr camera capture driver, by DanielePettenuzzo
💚 #11394 [WIP] add f7 bl update, by davids5
💚 #11393 sitl with gazebo: error opening serial device, by jlkjiji
💚 #11388 [DO NOT MERGE] hack to find params activated after boot complete, by dagar
💚 #11387 EKF2_AID_MASK -- Optical Flow With no GPS -- LeddarOne -- IntelAero, by gmetts
💚 #11386 Issues with omnibus target not booting, by r1b4z01d
💚 #11385 hysteresis cleanup and better field packing, by dagar
💚 #11384 SITL intermittent failure: param indices changing during sync, by dagar
💚 #11382 VTOL: fix roll inversion, by jlecoeur
💚 #11381 fw_pos_control_l1 add new simple min groundspeed, by dagar
💚 #11380 SITL intermittent failure: [Err] [gazebo_mavlink_interface.cpp:1018] poll timeout, by dagar
💚 #11374 STM32F7 disable d-cache see 1259864 Data corruption in a sequence of …, by davids5
💚 #11373 FW position control add takeoff minimum pitch, by dagar
💚 #11366 [WIP] mRo x2.1 777, by dagar
CLOSED ISSUES
❤️ #11419 Update submodule ecl to latest Sat Feb 9 00:38:44 UTC 2019, by dagar
❤️ #11416 Jenkins compile mac double timeout, by dagar
❤️ #11414 test time:Fixed bad assumption about RAND_MAX , by davids5
❤️ #11413 Not stable in position mode, by kapoorshivam100
❤️ #11411 mathlib Limits don't bother using references, by dagar
❤️ #11409 Jenkins SITL coverage build in place to handle paths properly, by dagar
❤️ #11408 Issue with Master_vehicle crash, by Tony3dr
❤️ #11406 fmu-v5 config split, by simonegu
❤️ #11404 Update submodule mavlink v2.0 to latest Thu Feb 7 00:37:49 UTC 2019, by dagar
❤️ #11403 Update submodule ecl to latest Thu Feb 7 00:38:05 UTC 2019, by dagar
❤️ #11398 Jenkins SITL tests increase test history from 2 -> 5, by dagar
❤️ #11396 EKF2 always use IMU timestamp as now, by dagar
❤️ #11392 Jenkins PX4 ROS deploy steps cleanup first, by dagar
❤️ #11391 Update submodule mavlink v2.0 to latest Wed Feb 6 00:37:50 UTC 2019, by dagar
❤️ #11390 Update submodule gencpp to latest Wed Feb 6 00:37:55 UTC 2019, by dagar
❤️ #11389 Update submodule genmsg to latest Wed Feb 6 00:38:01 UTC 2019, by dagar
❤️ #11383 Jenkins add SITL tests coverage pipeline, by dagar
❤️ #11379 px4io depend on NuttX submodules, by dagar
❤️ #11378 quick_check, Jenkins, appveyor avoid building px4_sitl twice, by dagar
❤️ #11377 Update submodule sitl_gazebo to latest Tue Feb 5 12:38:27 UTC 2019, by dagar
❤️ #11376 navigator minor cleanup, by dagar
❤️ #11375 Snapdragon flight Machine Vision SDK Version Compatibility, by SunggooJung
❤️ #11372 mc_att_control: landing gear publish correct message, by dagar
❤️ #11371 Jenkins hardware test remove px4_fmu-v4 stackcheck, by dagar
❤️ #11370 px4_fmu-v5 board spi cleanup, by dagar
❤️ #11369 Jenkins hardware increase test timeout and update container version, by dagar
❤️ #11368 Jenkins split MacOS builds into new pipeline, by dagar
❤️ #11367 auav x2.1 rc.defaults should be rc.board_defaults, by dagar
LIKED ISSUE
👍 #11400 simulator in hardware, new module, by romain-chiap
It received 👍 x1, 😄 x0, 🎉 x0 and ❤️ x0.
NOISY ISSUE
🔈 #11380 SITL intermittent failure: [Err] [gazebo_mavlink_interface.cpp:1018] poll timeout, by dagar
It received 12 comments.
PULL REQUESTS
Last week, 117 pull requests were created, updated or merged.
UPDATED PULL REQUEST
Last week, 77 pull requests were updated.
💛 #11422 update px4 dev containers to 2019-02-09, by dagar
💛 #11421 update mavlink to latest with addr of packed fix, by dagar
💛 #11418 Add
virtual
specifier to updateParamsImpl definition in _DEFINE_PARAMETER_UPDATE_METHOD(...) macro definition, by mcsauder💛 #11417 PX4_ISFINITE use builtin everywhere, by dagar
💛 #11415 navigation.h mission_item_s doesn't need to be packed, by dagar
💛 #11412 refactor ecl ekf analysis, by JohannesBrand
💛 #11407 update all submodules to PX4 forks, by dagar
💛 #11401 [DON'T MERGE] debug CI, by julianoes
💛 #11400 simulator in hardware, new module, by romain-chiap
💛 #11399 Dev traj fixes, by bresch
💛 #11397 px4_sitl_default temporarily disable lockstep scheduler, by dagar
💛 #11395 Pr camera capture driver, by DanielePettenuzzo
💛 #11394 [WIP] add f7 bl update, by davids5
💛 #11388 [DO NOT MERGE] hack to find params activated after boot complete, by dagar
💛 #11385 hysteresis cleanup and better field packing, by dagar
💛 #11382 VTOL: fix roll inversion, by jlecoeur
💛 #11381 fw_pos_control_l1 add new simple min groundspeed, by dagar
💛 #11374 STM32F7 disable d-cache see 1259864 Data corruption in a sequence of …, by davids5
💛 #11373 FW position control add takeoff minimum pitch, by dagar
💛 #11366 [WIP] mRo x2.1 777, by dagar
💛 #11365 Fix: ROS install space, by TSC21
💛 #11357 Disable data link and RC loss reactions for SITL, by MaEtUgR
💛 #11351 [WIP Do not merge] NXP i.MXRT port of PX4 FMUv5, by davids5
💛 #11347 fmu handle sensor_reset, peripheral_reset, i2c in board, by dagar
💛 #11336 [WIP] boards name and number external SPI consistently, by dagar
💛 #11318 parameters metadata generate as single static constexpr header, by dagar
💛 #11308 [WIP] Modularize Attitude Control, by MaEtUgR
💛 #11294 Jenkins: allow test to specify docker image with default, by lamping7
💛 #11287 SITL VTOL: scale outputs based on motor count (param VT_MOT_COUNT), by jlecoeur
💛 #11274 Variable initialization from constructor to declarations in mavlink_receiver.cpp and alphabetize var lists., by mcsauder
💛 #11272 TECS front transition and weathervane, by RomanBapst
💛 #11267 [Breaking Change]fmuk66-v3: Only Support Rev BX11, by davids5
💛 #11264 Close replay log file after replay is finished, then exit, by roangel
💛 #11261 [WIP] PX4 general work queue with orb callbacks, by dagar
💛 #11249 motor_ramp: set fmu in test mode and main cleanup, by DanielePettenuzzo
💛 #11234 Move test_tone and test_ppm out of test_hrt.cpp file into their own respective files., by mcsauder
💛 #11224 Adis16448 refactor, by mcsauder
💛 #11211 Fix Altitude Limitation, by MaEtUgR
💛 #11194 Remove goto statments, cleanup/tidying in tunes.cpp/h files., by mcsauder
💛 #11176 [WIP] uORB::Subscription subscribe directly to uORB device node object, by dagar
💛 #11167 Multicopter land detector - Add robustifying condition, by bresch
💛 #11080 Add back Slowdown close to ground in manual flight, by MaEtUgR
💛 #11012 Pr tecs front trans, by RomanBapst
💛 #10892 RPYrT Support. Format checked., by Pedro-Roque
💛 #10791 [WIP] Integration tests: Discussion, by Stifael
💛 #10780 Avoidance Interface CI, by mrivi
💛 #10774 [WIP] omnibus-f4sd osd integration, by DanielePettenuzzo
💛 #10733 Improve robustness to bad and lost airspeed data, by priseborough
💛 #10611 [WIP] navigator initialization and mode change improvements, by dagar
💛 #10525 [WIP] vmount: first step to support absolute angles, by julianoes
💛 #10522 WIP: accel cal index bug, by dagar
💛 #10394 Mavlink check transmit buffer before send, by dagar
💛 #10179 Failure detector / Failsafe (Parachute) triggering, by bresch
💛 #10175 commander auto disarm if kill switch engaged for 5 seconds, by dagar
💛 #10135 mavlink split BATTERY_STATUS from SYS_STATUS update, by dagar
💛 #10119 px4fmu split safety button into new module, by dagar
💛 #10093 WIP: mavlink GPS_INPUT support, by dagar
💛 #9849 create a range of common quadcopter frame sizes and general ROMFS cleanup, by dagar
💛 #9747 [WIP] mission_result split into mission_status and navigator_status, by dagar
💛 #9712 manual_control_setpoint split switches into new message manual_control_switches, by dagar
💛 #9471 launch: add launch specific idle throttle param, by tstastny
💛 #9243 FW position control add takeoff minimum pitch parameter, by dagar
💛 #9029 WIP: Pozyx addition to precision landing, by AndreasAntener
💛 #8908 Use control group target from mavlink message., by xgerrmann
💛 #8907 actuator controls update, by dagar
💛 #8618 Commander: Add land detection configuration to preflight checks, by LorenzMeier
💛 #8152 urtps: fix UART speed setting to work in Linux, by gamoreno
💛 #8138 Enable I2C2 bus of auav x21, by tubeme
💛 #8023 6 iris config files that correspond with 6 iris gazebo models. A laun…, by arwagoner
💛 #7985 [WIP][do not merge] Add OBC datalink failsafe in parallel with GCS datalink failsafe, by TSC21
💛 #7717 Reposition: Fix previous valid state to enable proper line following, by LorenzMeier
💛 #7693 Offboard type mask fix, by Seanmatthews
💛 #7676 sensors: use interpolation to set param from RC input, by davidaroyer
💛 #7432 [WIP] use local coordinates for position control (Global to local), by ChristophTobler
💛 #7363 [WIP] Smart RTL from @samuelsadok, by mhkabir
💛 #7208 [WIP] Implement MAIN and AUX pwm output on MindPX, by iZhangHui
💛 #6523 Auto mode handling UX improvements, by LorenzMeier
MERGED PULL REQUEST
Last week, 40 pull requests were merged.
💜 #11419 Update submodule ecl to latest Sat Feb 9 00:38:44 UTC 2019, by dagar
💜 #11416 Jenkins compile mac double timeout, by dagar
💜 #11414 test time:Fixed bad assumption about RAND_MAX , by davids5
💜 #11411 mathlib Limits don't bother using references, by dagar
💜 #11409 Jenkins SITL coverage build in place to handle paths properly, by dagar
💜 #11403 Update submodule ecl to latest Thu Feb 7 00:38:05 UTC 2019, by dagar
💜 #11398 Jenkins SITL tests increase test history from 2 -> 5, by dagar
💜 #11396 EKF2 always use IMU timestamp as now, by dagar
💜 #11392 Jenkins PX4 ROS deploy steps cleanup first, by dagar
💜 #11391 Update submodule mavlink v2.0 to latest Wed Feb 6 00:37:50 UTC 2019, by dagar
💜 #11390 Update submodule gencpp to latest Wed Feb 6 00:37:55 UTC 2019, by dagar
💜 #11389 Update submodule genmsg to latest Wed Feb 6 00:38:01 UTC 2019, by dagar
💜 #11383 Jenkins add SITL tests coverage pipeline, by dagar
💜 #11379 px4io depend on NuttX submodules, by dagar
💜 #11378 quick_check, Jenkins, appveyor avoid building px4_sitl twice, by dagar
💜 #11377 Update submodule sitl_gazebo to latest Tue Feb 5 12:38:27 UTC 2019, by dagar
💜 #11376 navigator minor cleanup, by dagar
💜 #11372 mc_att_control: landing gear publish correct message, by dagar
💜 #11371 Jenkins hardware test remove px4_fmu-v4 stackcheck, by dagar
💜 #11370 px4_fmu-v5 board spi cleanup, by dagar
💜 #11369 Jenkins hardware increase test timeout and update container version, by dagar
💜 #11368 Jenkins split MacOS builds into new pipeline, by dagar
💜 #11367 auav x2.1 rc.defaults should be rc.board_defaults, by dagar
💜 #11363 lockstep_scheduler: improve cmake target includes, by MaEtUgR
💜 #11362 startup: add plane_cam, by lamping7
💜 #11360 VTOL tiltrotor: respect VT_ELEV_MC_LOCK, by jlecoeur
💜 #11354 airframes: add Holybro QAV250, by bkueng
💜 #11353 Improve the module doc parser - subcategories/empty defaults, by bkueng
💜 #11350 Reduce false positives in pre-flight accel bias check, by priseborough
💜 #11327 Indicate version in which SYS_COMPANION deprecated, by hamishwillee
💜 #11325 Jenkins CI: PX4 ROS2: deploy required tools, by TSC21
💜 #11323 mavlink: improve comments about message forwarding, by julianoes
💜 #11306 Simulator small refactor, by MaEtUgR
💜 #11288 tiltrotor: fix transition check when airspeed is invalid, by jlecoeur
💜 #11265 gps: Emlid Reach support, by barchstien
💜 #11247 [WIP] Add script to set the correct ulimit on Mac OS, by LorenzMeier
💜 #11210 msg: add gps_yaw and mag_aligned to estimator_status, by CarlOlsson
💜 #10986 Update submodule ecl to latest, by dagar
💜 #10963 create example vehicle type build configs for fmu-v2 and fmu-v5, by dagar
💜 #10823 FW airframe defaults relax EKF2 GPS checks, by dagar
COMMITS
Last week there were 62 commits.
🛠️ Update submodule ecl to latest Sat Feb 9 00:38:44 UTC 2019 - ecl in PX4/Firmware (65377def832e82bd667ff6e0d00155c95b51b12e): https://github.com/PX4/ecl/commit/54ab8191e34b06dd2e6f96fe1b0adb971c5b77f0 - ecl current upstream: https://github.com/PX4/ecl/commit/1378ec179717448404c74819871d149217350b19 - Changes: https://github.com/PX4/ecl/compare/54ab8191e34b06dd2e6f96fe1b0adb971c5b77f0...1378ec179717448404c74819871d149217350b19 1378ec1 2019-02-07 Daniel Agar - EKF mag_fusion avoid unnecessary double promotion by PX4BuildBot
🛠️ px4_fmu-v5 remove PX4_FMUV5_RC00 by dagar
🛠️ px4_fmu-v5 board spi cleanup by dagar
🛠️ [test time: Fixed bad assumption about RAND_MAX (#11414) usleep range was up to 2147 Seconds
and
#define INT_MAX 2147483647](c6edf41) by davids5
🛠️ [mathlib Limits constexpr helpers don't use references (#11411) - fixes #11408
cleanup Limits.hpp](2217faf) by dagar
🛠️ Jenkins compile mac: double timeout (#11416) by dagar
🛠️ px4_module: document that the subcategory is optional by bkueng
🛠️ module documentation: add support for subcategories by bkueng
🛠️ PRINT_MODULE_USAGE_PARAM_{INT,FLOAT}: add support to ignore the default value by bkueng
🛠️ Jenkins SITL coverage build in place to handle gcov paths properly by dagar
🛠️ mc_att_control: landing gear publish correct message by dagar
🛠️ EKF2 use simplified ecl/EKF setIMUData by dagar
🛠️ EKF2 always use IMU timestamp as now by dagar
🛠️ Update submodule ecl to latest Thu Feb 7 00:38:05 UTC 2019 - ecl in PX4/Firmware (9580dea9c2ab12d9fd6eaa1a3232c7c80639bef4): https://github.com/PX4/ecl/commit/dd58e695494acab73fb6fcec7074291edb5c226b - ecl current upstream: https://github.com/PX4/ecl/commit/54ab8191e34b06dd2e6f96fe1b0adb971c5b77f0 - Changes: https://github.com/PX4/ecl/compare/dd58e695494acab73fb6fcec7074291edb5c226b...54ab8191e34b06dd2e6f96fe1b0adb971c5b77f0 54ab819 2019-02-06 Carl Olsson - EKF: add method to get the terrain variance c5554ca 2019-02-03 Daniel Agar - EKF tests update SWIG usage and use latest containers by PX4BuildBot
🛠️ navigator delete unused mission_yaw_mode by dagar
🛠️ navigator mission block fix get_time_inside() and cleanup helpers by dagar
🛠️ navigator initialize all mission items safely by dagar
🛠️ navigator orb subscribe/unsubscribe in constructor/destructor by dagar
🛠️ Jenkins SITL tests increase test history from 2 -> 5 by dagar
🛠️ Jenkins PX4 ROS deploy steps cleanup first by dagar
🛠️ [Update submodule mavlink v2.0 to latest Wed Feb 6 01:50:00 UTC 2019 (Update submodule mavlink v2.0 to latest Wed Feb 6 00:37:50 UTC 2019 #11391) - mavlink v2.0 in PX4/Firmware (068a10b8f062759c2af5e20433608289dd198366): https://github.com/mavlink/c_library_v2/commit/e302e1b735e47e9d33c3bad579dd7c6c089c1bb3
🛠️ [Update submodule gencpp to latest Wed Feb 6 01:50:06 UTC 2019 (Update submodule gencpp to latest Wed Feb 6 00:37:55 UTC 2019 #11390) - gencpp in PX4/Firmware (ed8517a): https://github.com/ros/gencpp/commit/b41ee3060badd660662e21cd9d4f81971c87a420
7e446a9 2019-01-25 James Xu - enable Windows build (Test Pull Request #38)](216a3e1) by dagar
🛠️ [Update submodule genmsg to latest Wed Feb 6 01:50:12 UTC 2019 (Update submodule genmsg to latest Wed Feb 6 00:38:01 UTC 2019 #11389) - genmsg in PX4/Firmware (d433877): https://github.com/ros/genmsg/commit/42e364661025b8f3d51486dc513d9e29cbd308da
5736b1f 2019-01-28 Dirk Thomas - add missing run_depend on empy (Make cpuload correct and more efficient for all configurations of NuttX #81)](6abd94e) by dagar
🛠️ create example vehicle type build configs for fmu-v2 and fmu-v5 (#10963) - update navigator precision landing to build without multicopter by dagar
🛠️ msg: add gps_yaw and mag_aligned to estimator_status Signed-off-by: CarlOlsson carlolsson.co@gmail.com by CarlOlsson
🛠️ Jenkins add SITL tests coverage pipeline by dagar
🛠️ check_submodules.sh don't force update in CI by dagar
🛠️ px4io depend on NuttX submodules by dagar
🛠️ appveyor: only build px4_sitl_tests (avoid building SITL twice) by dagar
🛠️ Jenkins mac compile run tests separately by dagar
🛠️ Makefile: quick_check avoid building px4_sitl twice by dagar
🛠️ [Update submodule sitl_gazebo to latest Tue Feb 5 12:38:27 UTC 2019 (Update submodule sitl_gazebo to latest Tue Feb 5 12:38:27 UTC 2019 #11377) - sitl_gazebo in PX4/Firmware (6178ead): https://github.com/PX4/sitl_gazebo/commit/12fb19ac6e7695ffc3dc9a64fcdd8499a522bd80
34d06e0 2019-02-05 Tully Foote - create plane_cam world
93159f3 2019-02-01 TSC21 - CMakeLists: install package.xml
c5882f7 2019-01-31 Anthony Lamping - models: plane: split up, adding plane_cam
38fe49a 2019-02-01 TSC21 - Travis CI: do not pass user id env var to the container
0f1221b 2019-02-01 TSC21 - Travis CI: update Ubuntu container tags
bab0de9 2019-01-31 Anthony Lamping - models: remove matrice 100 opt flow meshes
0efbe69 2019-01-23 Oleg Kalachev - Fix building on macOS](205b0d9) by dagar
🛠️ [mavlink: improve comments about message forwarding (#11323) This removes the confusing ugly magic number of 233 introduced as part
of https://github.com//pull/7670.
Also, the convoluted if is cleaned up using 3 separate bools with some
comments to explain what's going on.
This should not change anything function-wise except that the flight
controller could now potentially also use system ID 233 and not break
forwarding.](b17c0a1) by julianoes
🛠️ Add script to set the correct ulimit on Mac OS (#11247) by LorenzMeier
🛠️ Indicate version in which SYS_COMPANION deprecated (#11327) by hamishwillee
🛠️ Merge pull request #11288 from PX4/pr-tiltrotor_noairspeed_transition_check tiltrotor: fix transition check when airspeed is invalid by jlecoeur
🛠️ simulator_mavlink: zero initializer instead of memset Needed a clear scope inside a case for irlock_reports. by MaEtUgR
🛠️ simulator_mavlink: consistent system call scope operator by MaEtUgR
🛠️ Jenkins CI: PX4 ROS2 bridge stage: rollback test branch name by TSC21
🛠️ Jenkins CI: PX4 ROS2 bridge stage: deploy uORB RTPS ID map before the scripts by TSC21
🛠️ Jenkins CI: PX4 ROS2 bridge stage: update container tag by TSC21
🛠️ Jenkins: px4_ros_com deploy: test by TSC21
🛠️ Jenkins CI: PX4 ROS2: deploy required tools by TSC21
🛠️ Update platforms/posix/src/lockstep_scheduler/CMakeLists.txt Co-Authored-By: MaEtUgR maetugr@gmail.com by dagar
🛠️ lockstep_scheduler: correct cmake target includes by MaEtUgR
🛠️ FW airframe defaults relax EKF2 GPS checks by dagar
🛠️ [Jenkins hardware test remove px4_fmu-v4 stackcheck - the stackcheck build is too slow to be useful
🛠️ airframes: add Holybro QAV250 by bkueng
🛠️ gps: Support for Emlid Reach Support Emlid Reach in ERB format, including autodetect Reported-by: Bastien Auneau bastien.auneau@while-true.fr by barchstien
🛠️ commander: remove duplicate check by priseborough
🛠️ PreflightCheck trivial astyle fix by dagar
🛠️ commander: Reduce false positives in pre-flight accel bias check by priseborough
🛠️ Jenkins split MacOS builds into new pipeline by dagar
🛠️ Jenkins hardware increase test timeout and update container version by dagar
🛠️ Tiltrotor: Do not lock elevons in multirotor mode The behaviour is unchanged because VT_ELEV_MC_LOCK was not implemented for tiltrotors by jlecoeur
🛠️ Convergence: Do not lock elevons in multirotor mode The behaviour is unchanged because VT_ELEV_MC_LOCK was not implemented for tiltrotors by jlecoeur
🛠️ Claire: Do not lock elevons in multirotor mode The behaviour is unchanged because VT_ELEV_MC_LOCK was not implemented for tiltrotors by jlecoeur
🛠️ FireFly6: Do not lock elevons in multirotor mode The behaviour is unchanged because VT_ELEV_MC_LOCK was not implemented for tiltrotors by jlecoeur
🛠️ VTOL tiltrotor: respect VT_ELEV_MC_LOCK by jlecoeur
🛠️ startup: add plane_cam by lamping7
🛠️ Update submodule ecl to latest Sun Feb 3 07:37:55 EST 2019 - ecl in PX4/Firmware (0dc2ccb130e891b387b4e0d6ea4492473339e142): https://github.com/PX4/ecl/commit/721f5e61a5965a08a34b2875d2bdc0b5d3b80601 - ecl current upstream: https://github.com/PX4/ecl/commit/dd58e695494acab73fb6fcec7074291edb5c226b - Changes: https://github.com/PX4/ecl/compare/721f5e61a5965a08a34b2875d2bdc0b5d3b80601...dd58e695494acab73fb6fcec7074291edb5c226b dd58e69 2019-01-30 Paul Riseborough - EKF: Ensure FW yaw alignment method is used on first in-air reset 3accab1 2019-01-28 Paul Riseborough - EKF: protect declination fusion from badly conditioned earth field estimates 7bddbd1 2019-01-28 Paul Riseborough - EKF: Update cleaned up autocode fragment with sign error fix and missing LD fe378fd 2019-01-22 Paul Riseborough - EKF: Prevent unwanted declination fusion when re-starting 3-axis fusion bd1647a 2019-01-22 Paul Riseborough - EKF: Rework use of fuseDeclination() d52f536 2019-01-17 Paul Riseborough - EKF: Save mag field covariance data before reset 82ce7a8 2019-01-17 Paul Riseborough - EKF: Save mag field covariance information on startup 708c79e 2019-01-17 Paul Riseborough - EKF: Ensure mag field state covariance data is always available for re-use 8839e4e 2019-01-17 Paul Riseborough - EKF: Don't discard declination certainty information when resuming 3-axis fusion. 25148e1 2019-01-17 Paul Riseborough - EKF: Prevent rapid changes in declination estimate after a reset 6e7c119 2019-01-16 CarlOlsson - EKF: limit yaw variance increase to 0.01 rad^2 to prevent a badly conditioned covariance matrix 0896f7b 2019-01-16 CarlOlsson - EKF: Also fill in lower part of covariance matrix in increaseQuatYawErrVariance() 4b3140e 2019-01-16 Paul Riseborough - EKF: Fix rebase error 911d4d8 2019-01-16 Paul Riseborough - EKF: Fix sign error in increaseQuatYawErrVariance function a0b9cb0 2018-12-24 Paul Riseborough - EKF: Use consistent method for recording completion of in-flight yaw alignment ef5a87c 2018-12-21 Paul Riseborough - EKF: Rework quaternion yaw reset. fc2a089 2018-12-21 Paul Riseborough - EKF: Add function to un-correlate quaternion states bce1b96 2018-12-21 Paul Riseborough - EKF: Add function enabling yaw variance to be increased bf1f3a2 2018-12-21 Paul Riseborough - EKF: Derive equations enabling yaw variance to be increased 81eabc1 2019-01-29 Daniel Agar - Jenkins update all containers to latest tag 2019-01-28 a5e6191 2019-01-29 Daniel Agar - EKF add clarity brackets to avoid potential confusion by PX4BuildBot
🛠️ auav x2.1 rc.defaults should be rc.board_defaults by dagar
CONTRIBUTORS
Last week there were 14 contributors.
👤 PX4BuildBot
👤 dagar
👤 davids5
👤 bkueng
👤 CarlOlsson
👤 julianoes
👤 LorenzMeier
👤 hamishwillee
👤 jlecoeur
👤 MaEtUgR
👤 TSC21
👤 barchstien
👤 priseborough
👤 lamping7
STARGAZERS
Last week there were 16 stagazers.
⭐ stefan0x53
⭐ adebayorajide
⭐ yousef147798
⭐ RestfulItGuy
⭐ shayanesadat
⭐ metenik
⭐ nghson
⭐ jd1488sfv
⭐ afurculita
⭐ omerfarukdemirci
⭐ crazySocket
⭐ saeeddhqan
⭐ ypca
⭐ panosvs
⭐ zebrajack
⭐ pocketfpv
You all are the stars! 🌟
RELEASES
Last week there were no releases.
That's all for last week, please 👀 Watch and ⭐ Star the repository PX4/Firmware to receive next weekly updates. 😃
You can also view all Weekly Digests by clicking here.
The text was updated successfully, but these errors were encountered: