Randy Mackay
cca05ee8ae
Copter: start dataflash logging when arming
...
Stop nearly empty logs from being produced.
Removed redundant armed bit from ap state.
12 years ago
Randy Mackay
58d1da2d80
Copter: integrate AC_Fence in place of limits
...
Lesser functionality than limits but saves more than 150 bytes and it
works
12 years ago
Andrew Tridgell
82c604dd67
Copter: more constrain fixes
12 years ago
Randy Mackay
a53e5f747b
Copter: add fourth yaw behaviour, look-at-home
...
Added get_wp_yaw_mode to remove duplication of checks of the
WP_YAW_BEHAVIOR parameter
12 years ago
Andrew Tridgell
02c3083f60
Copter: print flight mode as string
12 years ago
Andrew Tridgell
a0708460a4
Copter: convert to new logging system
12 years ago
Randy Mackay
d2bd818b2d
Copter: bug fix for auto_armed logic
...
Zero throttle when switching into an auto flight mode would cause the
motors to stop.
12 years ago
Randy Mackay
f82ce449d7
AC_WPNav: add angle limits and set from AC's throttle controller
12 years ago
Randy Mackay
1516972eaa
Copter: add panorama to CIRCLE mode
...
Yaw will slowly rotate if CIRCLE_RADIUS is set to zero
Circle center is projected forward CIRCLE_RADIUS from current position
and heading
12 years ago
Randy Mackay
58ed8cd544
Copter: replace set_next_WP with direct call to wp_nav
12 years ago
Randy Mackay
49828eba7d
Copter: integrate AC_WPNav
12 years ago
Randy Mackay
d1afd2fb9b
Copter: make guided mode start at current location
12 years ago
Randy Mackay
7cf2255822
Copter LEDs: replace bitRead with bitmask
...
Consolidate all checks of led_mode to leds.pde
Add #defines for bitmasks comparisons
Some formatting changes
12 years ago
Randy Mackay
80bd593814
Copter: disarm motors when entering CLI
12 years ago
Randy Mackay
dcf21eee8f
Copter: only allow entering the CLI within 30 seconds of start-up
12 years ago
Andrew Tridgell
952c56e990
Copter: fixed barometer init in HIL sensors mode
12 years ago
Randy Mackay
36834e77b5
Copter: remove support for CLI Slider
12 years ago
Randy Mackay
f9539384a1
Copter: rename failsafe to failsafe_radio
...
Makes way for separation of failsafes for throttle, gps and gcs
12 years ago
Randy Mackay
0d5e731a65
Copter: add compassmot to cli
...
Allows user to setup compensation for motor's interference on the
compass
12 years ago
Randy Mackay
cbde042ec5
Copter: remove non-inav loiter and wp controllers
...
lon_speed, lat_speed changed to float
do_takeoff, do_land now set roll-pitch, yaw and nav modes specifically
removed fast_corners functionality (may need to be reimplemented with
new inertial nav controllers)
12 years ago
Randy Mackay
67c69a19ee
Copter: remove baro-only alt hold
...
Saves 8 bytes of memory and more importantly simplifies the alt hold
calculations
12 years ago
Randy Mackay
b74fe10aa9
Copter: set each flight mode's nav_mode
...
Allow ACRO flight mode's roll, pitch, yaw, throttle and nav mode to be
overwritten
12 years ago
Randy Mackay
aaecc25ac7
Copter: leonard's inav2
...
Moved loiter controller to navigation.pde
12 years ago
Randy Mackay
fd02cfe706
Copter: added set_nav_mode to control initialisation of nav controllers
...
Renamed run_navigation_controllers() to run_autopilot()
Renamed update_nav_wp() to update_nav_mode()
Renamed wp_control to nav_mode to be more consistent with roll-pitch,
yaw and throttle controllers
12 years ago
Randy Mackay
911e090e07
Copter: typo fixed for trad heli config
12 years ago
Randy Mackay
08dc730d40
ArduCopter: bug fix to LAND flight mode not actually landing if initiated from failsafe
...
An hidden bit of failsafe functionality in the set_mode function was
switching the throttle mode back to THROTTLE_AUTO instead of
THROTTLE_LAND
12 years ago
Andrew Tridgell
36e38eeef7
Copter: ensure ahrs.init() is called
12 years ago
Randy Mackay
87627d883b
ArduCopter: use new logging method for remaining packet types
...
Additional changes include renaming RAW dataflash type to IMU
12 years ago
Andrew Tridgell
585459ece9
Copter: tweak the serial buffer sizes
...
we only need the large buffers for HIL
12 years ago
Andrew Tridgell
17a63dc76a
Copter: fixes for AP_HAL merge
12 years ago
rmackay9
68b62abd38
ArduCopter with the new Camera and Relay classes for APM1 and APM2.
...
All changes by Sandro Benigno
12 years ago
rmackay9
e77b54c7dc
ArduCopter: bug fix to GUIDED mode. Now checks that desired altitude was reached before deciding the waypoint is complete.
12 years ago
Robert Lefebvre
6e64b1b357
ACM: Precision Loiter RePositioning code.
...
Protected behind a #define
12 years ago
rmackay9
6da68c53a5
ArduCopter: bug fix so AP_Limits does not use up memory if it is disabled
12 years ago
rmackay9
50d46898fb
ArduCopter: allow GUIDED mode roll-pitch, yaw and throttle control modes to be overridden
12 years ago
Andrew Tridgell
cf8e648558
CLI: fixed accel setup
...
disable mavlink callback in CLI
12 years ago
Andrew Tridgell
9e986801c9
Copter: fixed SITL for ArduCopter
12 years ago
Andrew Tridgell
08b1c2d590
Copter: fixed GPS init
12 years ago
Pat Hickey
2aa4657315
ArduCopter: changes to use CONFIG_HIL_BOARD
12 years ago
Pat Hickey
5bd7046a95
ArduCopter: sketch cpp builds!
12 years ago
Pat Hickey
4b84e99f85
remove dumb user hooks comments
12 years ago
Pat Hickey
901c692ee3
arducopter: type fix
12 years ago
Pat Hickey
d9e0bbbbab
ArduCopter: first pass at AP_HAL porting
...
* changed all the byte types to uint8_t
* fixed up much of the serial stuff
12 years ago
Jason Short
19ae5c30eb
ACM : Formatting
12 years ago
rmackay9
b36eb406d4
ArduCopter: allow alt hold to be engaged with alt < 1m because sometimes we get baro drift.
...
Also initialisation of target altitude is done in set_throttle_mode function.
12 years ago
Robert Lefebvre
aa4d4f8c24
ACM: Adding Pre-Compiler Define for Stabilize Throttle Mode.
12 years ago
rmackay9
9dd978576b
ArduCopter: auto yaw changes to allow pilot override of yaw during missions
...
Added set_yaw_mode to better control of yaw controller changes and variable initialisation.
Replaced AUTO_YAW mode with separate yaw controllers YAW_LOOK_AT_NEXT_WP, YAW_LOOK_AT_LOCATION, YAW_LOOK_AT_HEADING.
Pilot manual override of yaw causes yaw to change to YAW_HOLD (i.e. manual yaw) until next waypoint is reached.
Added get_yaw_slew function to control how quickly autopilot turns copter
Changed YAW_LOOK_AHEAD to use GPS heading and moved to new get_look_ahead_yaw function in Attitude.pde
Renamed variables: target_bearing->wp_bearing, original_target_bearing->original_wp_bearing.
Removed auto_yaw_tracking and auto_yaw variables and update_auto_yaw function as they are no longer needed.
Simplified MAV_CMD_CONDITION_YAW handling (do_yaw). We lose ability to control direction of turn and ability to do long panorama shots but it now works between waypoints and save 20bytes.
12 years ago
rmackay9
269e02ee93
ArduCopter: bug fix - initialise inertial nav
12 years ago
rmackay9
a5bb54e36e
ArduCopter: RTL clean-up and slightly improved landing sensor
...
Consolidated RTL state to be captured by rtl_state variable.
Combined update_RTL_Nav and verify_RTL functions which performed the same function but one was for missions, the other for the RTL flight mode.
Renamed some RTL parameters and global variables to have RTL at the front.
Landing detector now checks accel-throttle's I term and/or a very low throttle value
12 years ago
rmackay9
a94826f182
ArduCopter: add set_throttle_mode to better control initialisation of variables
12 years ago