Real-time collaboration for Jupyter Notebooks, Linux Terminals, LaTeX, VS Code, R IDE, and more,
all in one place. Commercial Alternative to JupyterHub.
Real-time collaboration for Jupyter Notebooks, Linux Terminals, LaTeX, VS Code, R IDE, and more,
all in one place. Commercial Alternative to JupyterHub.
Path: blob/master/libraries/AC_Fence/AC_Fence.h
Views: 1798
#pragma once12#include "AC_Fence_config.h"34#if AP_FENCE_ENABLED56#include <inttypes.h>7#include <AP_Common/AP_Common.h>8#include <AP_Common/ExpandingString.h>9#include <AP_Param/AP_Param.h>10#include <AP_Math/AP_Math.h>11#include <AC_Fence/AC_PolyFence_loader.h>1213// bit masks for enabled fence types. Used for TYPE parameter14#define AC_FENCE_TYPE_ALT_MAX 1 // high alt fence which usually initiates an RTL15#define AC_FENCE_TYPE_CIRCLE 2 // circular horizontal fence (usually initiates an RTL)16#define AC_FENCE_TYPE_POLYGON 4 // polygon horizontal fence17#define AC_FENCE_TYPE_ALT_MIN 8 // low alt fence which usually initiates an RTL18#define AC_FENCE_ARMING_FENCES (AC_FENCE_TYPE_ALT_MAX | AC_FENCE_TYPE_CIRCLE | AC_FENCE_TYPE_POLYGON)19#define AC_FENCE_ALL_FENCES (AC_FENCE_ARMING_FENCES | AC_FENCE_TYPE_ALT_MIN)2021// valid actions should a fence be breached22#define AC_FENCE_ACTION_REPORT_ONLY 0 // report to GCS that boundary has been breached but take no further action23#define AC_FENCE_ACTION_RTL_AND_LAND 1 // return to launch and, if that fails, land24#define AC_FENCE_ACTION_ALWAYS_LAND 2 // always land25#define AC_FENCE_ACTION_SMART_RTL 3 // smartRTL, if that fails, RTL, it that still fails, land26#define AC_FENCE_ACTION_BRAKE 4 // brake, if that fails, land27#define AC_FENCE_ACTION_SMART_RTL_OR_LAND 5 // SmartRTL, if that fails, Land28#define AC_FENCE_ACTION_GUIDED 6 // guided mode, with target waypoint as fence return point29#define AC_FENCE_ACTION_GUIDED_THROTTLE_PASS 7 // guided mode, but pilot retains manual throttle control3031// give up distance32#define AC_FENCE_GIVE_UP_DISTANCE 100.0f // distance outside the fence at which we should give up and just land. Note: this is not used by library directly but is intended to be used by the main code3334class AC_Fence35{36public:37friend class AC_PolyFence_loader;3839enum class AutoEnable : uint8_t40{41ALWAYS_DISABLED = 0,42ENABLE_ON_AUTO_TAKEOFF = 1, // enable on auto takeoff43ENABLE_DISABLE_FLOOR_ONLY = 2, // enable on takeoff but disable floor on landing44ONLY_WHEN_ARMED = 3 // enable on arming45};4647enum class MavlinkFenceActions : uint16_t48{49DISABLE_FENCE = 0,50ENABLE_FENCE = 1,51DISABLE_ALT_MIN_FENCE = 252};5354AC_Fence();5556/* Do not allow copies */57CLASS_NO_COPY(AC_Fence);5859void init() {60_poly_loader.init();61}6263// get singleton instance64static AC_Fence *get_singleton() { return _singleton; }6566/// enable - allows fence to be enabled/disabled.67/// returns a bitmask of fences that were changed68uint8_t enable(bool value, uint8_t fence_types, bool update_auto_mask = true);6970/// enable_configured - allows configured fences to be enabled/disabled.71/// returns a bitmask of fences that were changed72uint8_t enable_configured(bool value) { return enable(value, _configured_fences, true); }7374/// auto_enabled - automaticaly enable/disable fence depending of flight status75AutoEnable auto_enabled() const { return static_cast<AutoEnable>(_auto_enabled.get()); }7677/// enable_floor - allows fence floor to be enabled/disabled. Note this does not update the eeprom saved value78void enable_floor();7980/// disable_floor - allows fence floor to be enabled/disabled. Note this does not update the eeprom saved value81void disable_floor();8283/// auto_enable_fence_on_takeoff - auto enables the fence. Called after takeoff conditions met84void auto_enable_fence_after_takeoff();8586/// auto_enable_fences_on_arming - auto enables all applicable fences on arming87void auto_enable_fence_on_arming();8889/// auto_disable_fences_on_disarming - auto disables all applicable fences on disarming90void auto_disable_fence_on_disarming();9192uint8_t get_auto_disable_fences(void) const;9394/// auto_enable_fence_floor - auto enables fence floor once desired altitude has been reached.95bool auto_enable_fence_floor();9697/// enabled - returns whether fencing is enabled or not98bool enabled() const { return _enabled_fences; }99100/// present - returns true if any of the provided types is present101uint8_t present() const;102103/// get_enabled_fences - returns bitmask of enabled fences104uint8_t get_enabled_fences() const;105106// should be called @10Hz to handle loading from eeprom107void update();108109/// pre_arm_check - returns true if all pre-takeoff checks have completed successfully110bool pre_arm_check(char *failure_msg, const uint8_t failure_msg_len) const;111112///113/// methods to check we are within the boundaries and recover114///115116/// check - returns the fence type that has been breached (if any)117/// disabled_fences can be used to disable fences for certain conditions (e.g. landing)118uint8_t check(bool disable_auto_fence = false);119120// returns true if the destination is within fence (used to reject waypoints outside the fence)121bool check_destination_within_fence(const class Location& loc);122123/// get_breaches - returns bit mask of the fence types that have been breached124uint8_t get_breaches() const { return _breached_fences; }125126/// get_breach_time - returns time the fence was breached127uint32_t get_breach_time() const { return _breach_time; }128129/// get_breach_count - returns number of times we have breached the fence130uint16_t get_breach_count() const { return _breach_count; }131132/// get_breach_distance - returns maximum distance in meters outside133/// of the given fences. fence_type is a bitmask here.134float get_breach_distance(uint8_t fence_type) const;135136/// get_action - getter for user requested action on limit breach137uint8_t get_action() const { return _action.get(); }138139/// get_safe_alt - returns maximum safe altitude (i.e. alt_max - margin)140float get_safe_alt_max() const { return _alt_max - _margin; }141142/// get_safe_alt_min - returns the minimum safe altitude (i.e. alt_min + margin)143float get_safe_alt_min() const { return _alt_min + _margin; }144145/// get_radius - returns the fence radius in meters146float get_radius() const { return _circle_radius.get(); }147148/// get_margin - returns the fence margin in meters149float get_margin() const { return _margin.get(); }150151/// get_return_rally - returns whether returning to fence return point or rally point152uint8_t get_return_rally() const { return _ret_rally; }153154/// get_return_rally - returns whether returning to fence return point or rally point155float get_return_altitude() const { return _ret_altitude; }156157/// get a user-friendly list of fences158static void get_fence_names(uint8_t fences, ExpandingString& msg);159160// print a message about the fences to the GCS161void print_fence_message(const char* msg, uint8_t fences) const;162163/// manual_recovery_start - caller indicates that pilot is re-taking manual control so fence should be disabled for 10 seconds164/// should be called whenever the pilot changes the flight mode165/// has no effect if no breaches have occurred166void manual_recovery_start();167168// methods for mavlink SYS_STATUS message (send_sys_status)169bool sys_status_present() const;170bool sys_status_enabled() const;171bool sys_status_failed() const;172173AC_PolyFence_loader &polyfence();174const AC_PolyFence_loader &polyfence() const;175176enum class OPTIONS {177DISABLE_MODE_CHANGE = 1U << 0,178INCLUSION_UNION = 1U << 1,179};180static bool option_enabled(OPTIONS opt, const AP_Int16 &options) {181return (options.get() & int16_t(opt)) != 0;182}183bool option_enabled(OPTIONS opt) const {184return option_enabled(opt, _options);185}186187static const struct AP_Param::GroupInfo var_info[];188189#if AP_SDCARD_STORAGE_ENABLED190bool failed_sdcard_storage(void) const {191return _poly_loader.failed_sdcard_storage();192}193#endif194195private:196static AC_Fence *_singleton;197198/// check_fence_alt_max - true if max alt fence has been newly breached199bool check_fence_alt_max();200201/// check_fence_alt_min - true if min alt fence has been newly breached202bool check_fence_alt_min();203204/// check_fence_polygon - true if polygon fence has been newly breached205bool check_fence_polygon();206207/// check_fence_circle - true if circle fence has been newly breached208bool check_fence_circle();209210/// record_breach - update breach bitmask, time and count211void record_breach(uint8_t fence_type);212213/// clear_breach - update breach bitmask, time and count214void clear_breach(uint8_t fence_type);215216// additional checks for the different fence types:217bool pre_arm_check_polygon(char *failure_msg, const uint8_t failure_msg_len) const;218bool pre_arm_check_circle(char *failure_msg, const uint8_t failure_msg_len) const;219bool pre_arm_check_alt(char *failure_msg, const uint8_t failure_msg_len) const;220// fence floor is enabled221bool floor_enabled() const { return _enabled_fences & AC_FENCE_TYPE_ALT_MIN; }222223// parameters224uint8_t _enabled_fences; // fences that are currently enabled/disabled225bool _last_enabled; // value of enabled last time we checked226AP_Int8 _enabled; // overall feature control227AP_Int8 _auto_enabled; // top level flag for auto enabling fence228uint8_t _last_auto_enabled; // value of auto_enabled last time we checked229AP_Int8 _configured_fences; // bit mask holding which fences are enabled230AP_Int8 _action; // recovery action specified by user231AP_Float _alt_max; // altitude upper limit in meters232AP_Float _alt_min; // altitude lower limit in meters233AP_Float _circle_radius; // circle fence radius in meters234AP_Float _margin; // distance in meters that autopilot's should maintain from the fence to avoid a breach235AP_Int8 _total; // number of polygon points saved in eeprom236AP_Int8 _ret_rally; // return to fence return point or rally point/home237AP_Int16 _ret_altitude; // return to this altitude238AP_Int16 _options; // options bitmask, see OPTIONS enum239240// backup fences241float _alt_max_backup; // backup altitude upper limit in meters used to refire the breach if the vehicle continues to move further away242float _alt_min_backup; // backup altitude lower limit in meters used to refire the breach if the vehicle continues to move further away243float _circle_radius_backup; // backup circle fence radius in meters used to refire the breach if the vehicle continues to move further away244245// breach distances246float _alt_max_breach_distance; // distance above the altitude max247float _alt_min_breach_distance; // distance below the altitude min248float _circle_breach_distance; // distance beyond the circular fence249250// other internal variables251float _home_distance; // distance from home in meters (provided by main code)252253// breach information254uint8_t _breached_fences; // bitmask holding the fence type that was breached (i.e. AC_FENCE_TYPE_ALT_MIN, AC_FENCE_TYPE_CIRCLE)255uint32_t _breach_time; // time of last breach in milliseconds256uint16_t _breach_count; // number of times we have breached the fence257uint32_t _last_breach_notify_sent_ms; // last time we sent a message about newly-breaching the fences258259uint32_t _manual_recovery_start_ms; // system time in milliseconds that pilot re-took manual control260261enum class MinAltState262{263DEFAULT = 0,264MANUALLY_ENABLED,265MANUALLY_DISABLED266} _min_alt_state;267268269AC_PolyFence_loader _poly_loader{_total, _options}; // polygon fence270};271272namespace AP {273AC_Fence *fence();274};275276#endif // AP_FENCE_ENABLED277278279