aboutsummaryrefslogtreecommitdiff
path: root/src/modules/multirotor_att_control
Commit message (Collapse)AuthorAgeFilesLines
* multirotor_att_control: cleanup, some refactoringAnton Babushkin2013-10-071-199/+198
|
* Hotfix: Use sensible default gains for users not being able to read ↵Lorenz Meier2013-09-122-8/+8
| | | | instructions.
* Full failsafe rewrite.Anton Babushkin2013-08-271-57/+41
|
* multirotor_att_control: yaw control bug fixedAnton Babushkin2013-08-271-14/+17
|
* Fix timestamp on rates_sptstellanova2013-08-231-0/+2
|
* Merged seatbelt_multirotor_newLorenz Meier2013-08-231-43/+59
|\
| * multirotor_att_control: yaw setpoint reset fixAnton Babushkin2013-08-221-50/+53
| |
* | Reset yaw position when disarmed in multirotor controllerJulian Oes2013-08-221-16/+2
|/
* vehicle_control_mode.flag_armed added, reset integrals in ↵Anton Babushkin2013-08-195-28/+25
| | | | multirotor_att_control when disarmed
* commander, multirotor_att_control, position_estimator_inav: position valid ↵Anton Babushkin2013-08-171-7/+13
| | | | flag fixed, other fixes and cleaunup
* commander, multirotor_pos_control, multirotor_att_control: bugfixesAnton Babushkin2013-08-161-4/+4
|
* multirotor_att_control: run rate controller only if vehicle_control_mode ↵Anton Babushkin2013-08-161-20/+23
| | | | flag set, codestyle fixed
* Merge branch 'seatbelt_multirotor' into seatbelt_multirotor_newAnton Babushkin2013-08-165-109/+134
|\ | | | | | | WIP, TODO fixedwing
| * Merge branch 'master' into seatbelt_multirotorAnton Babushkin2013-07-081-1/+1
| |\
| * \ Merge branch 'att_control_der_fix' into seatbelt_multirotorAnton Babushkin2013-06-284-60/+73
| |\ \
| * | | Merge branch 'master' into seatbelt_multirotorAnton Babushkin2013-05-171-33/+50
| | | |
* | | | Renamed actuator_safety back to actuator_armed, compiling but untestedJulian Oes2013-07-151-9/+9
| | | |
* | | | Merge branch 'master' into new_state_machineJulian Oes2013-07-085-60/+66
|\ \ \ \ | | |_|/ | |/| | | | | | | | | | | | | | | | | | | | | | | | | | | | | | | | | | | | | | | | | | | | | | compiling again Conflicts: src/modules/fixedwing_att_control/fixedwing_att_control_att.c src/modules/fixedwing_att_control/fixedwing_att_control_rate.c src/modules/fixedwing_pos_control/fixedwing_pos_control_main.c src/modules/mavlink/orb_listener.c src/modules/multirotor_att_control/multirotor_attitude_control.c src/modules/multirotor_att_control/multirotor_rate_control.c src/modules/systemlib/pid/pid.c src/modules/systemlib/pid/pid.h src/modules/uORB/objects_common.cpp
| * | | Merge branch 'master' of github.com:PX4/Firmware into origin_integrationLorenz Meier2013-07-024-60/+73
| |\ \ \ | | | |/ | | |/|
| | * | Copyright fixesAnton Babushkin2013-06-224-24/+50
| | | |
| | * | multirotor_attitude_control performance improved, tested in flight. PID ↵Anton Babushkin2013-06-202-37/+24
| | |/ | | | | | | | | | library new functionality and bugfixes.
| * / Rename our 'task_spawn' to 'task_spawn_cmd' since NuttX now has its own ↵px4dev2013-06-011-1/+1
| |/ | | | | | | version of task_spawn that's different.
* | Only some small cleanup to att controlJulian Oes2013-06-241-77/+23
| |
* | Adapted flow estimator, position and velocity control to new state machineJulian Oes2013-06-242-5/+5
| |
* | Merge remote-tracking branch 'drton/pid_fixes_drton_debug' into ↵Julian Oes2013-06-204-16/+11
|\ \ | | | | | | | | | | | | | | | | | | | | | | | | | | | | | | new_state_machine Conflicts: src/modules/multirotor_att_control/multirotor_att_control_main.c src/modules/multirotor_att_control/multirotor_attitude_control.c src/modules/multirotor_att_control/multirotor_rate_control.c src/modules/multirotor_att_control/multirotor_rate_control.h src/modules/sdlog2/sdlog2.c
| * | Cleanup: remove useless angular rates from attitude rate controllerAnton Babushkin2013-06-203-11/+5
| | |
| * | Att rate PID fixAnton Babushkin2013-06-201-4/+5
| | |
| * | Added integral reset for rate controllerJulian Oes2013-06-191-0/+6
| | |
| * | Cherry-picked commit e2ff60b0a6dbcd714d57e781d9fe174b110a6237: use rateacc ↵Julian Oes2013-06-193-20/+32
| | | | | | | | | | | | values
| * | Checkpoint: Quad is flying after PID lib changesJulian Oes2013-06-172-7/+5
| | | | | | | | | | | | | | | Conflicts: src/modules/multirotor_att_control/multirotor_attitude_control.c
* | | Added integral reset for rate controllerJulian Oes2013-06-191-0/+6
| | |
* | | Use rollacc and pitchacc from the estimator instead of differentiating in ↵Julian Oes2013-06-193-12/+19
| | | | | | | | | | | | the controller
* | | Checkpoint: Quad is flying after PID lib changesJulian Oes2013-06-172-9/+7
| | |
* | | Merge branch 'pid_fixes' into new_state_machineJulian Oes2013-06-165-20/+27
|\| | | | | | | | | | | | | | | | | | | | | | | | | | Conflicts: src/modules/multirotor_att_control/multirotor_rate_control.c src/modules/sdlog2/sdlog2.c src/modules/sdlog2/sdlog2_messages.h and some fixes, logging of control PID values now working
| * | Added ctrl debugging valuesJulian Oes2013-06-161-2/+14
| | | | | | | | | | | | | | | Conflicts: src/modules/sdlog2/sdlog2.c
| * | Added possibility to log pid control valuesJulian Oes2013-06-162-4/+4
| | | | | | | | | | | | | | | | | | Conflicts: apps/multirotor_pos_control/multirotor_pos_control.c src/drivers/ardrone_interface/ardrone_interface.c
| * | Fixed pid bug, attitude was not controlledJulian Oes2013-06-161-4/+6
| | |
* | | Tried to add ctrl debug values to sdlog2 (WIP)Julian Oes2013-06-161-0/+1
| | |
* | | Added ctrl debugging valuesJulian Oes2013-06-161-2/+14
| | |
* | | Added possibility to log pid control valuesJulian Oes2013-06-162-4/+4
| | | | | | | | | | | | | | | | | | Conflicts: apps/multirotor_pos_control/multirotor_pos_control.c src/drivers/ardrone_interface/ardrone_interface.c
* | | Fixed pid bug, attitude was not controlledJulian Oes2013-06-161-4/+6
| | |
* | | Merge branch 'pid_fixes' into new_state_machineJulian Oes2013-06-152-56/+28
|\| |
| * | Added a filter parameter to the pid functionJulian Oes2013-06-152-8/+8
| | | | | | | | | | | | | | | Conflicts: apps/multirotor_pos_control/multirotor_pos_control.c
| * | Use the pid library in the rate controller and change de implementation of ↵Julian Oes2013-06-152-55/+27
| |/ | | | | | | | | | | | | | | | | the D part Conflicts: src/modules/multirotor_att_control/multirotor_rate_control.c src/modules/systemlib/pid/pid.c src/modules/systemlib/pid/pid.h
* | Controllers should not access state machine anymore but access the ↵Julian Oes2013-06-151-22/+23
| | | | | | | | vehicle_control_mode flags
* | Introduced new actuator_safety topicJulian Oes2013-06-141-5/+16
| |
* | Merge remote-tracking branch 'upstream/master' into new_state_machineJulian Oes2013-05-171-32/+38
|/ | | | | | | Conflicts: src/drivers/px4io/px4io.cpp src/modules/commander/commander.c src/modules/commander/state_machine_helper.c
* docs fixLorenz Meier2013-04-271-1/+1
|
* Moved multirotor controllersLorenz Meier2013-04-276-0/+1119