Skip to content
Snippets Groups Projects
UAS.h 22.7 KiB
Newer Older
  • Learn to ignore specific revisions
  • pixhawk's avatar
    pixhawk committed
    /*=====================================================================
    
    
    QGroundControl Open Source Ground Control Station
    
    pixhawk's avatar
    pixhawk committed
    
    
    (c) 2009, 2010 QGROUNDCONTROL PROJECT <http://www.qgroundcontrol.org>
    
    pixhawk's avatar
    pixhawk committed
    
    
    This file is part of the QGROUNDCONTROL project
    
    pixhawk's avatar
    pixhawk committed
    
    
        QGROUNDCONTROL is free software: you can redistribute it and/or modify
    
    pixhawk's avatar
    pixhawk committed
        it under the terms of the GNU General Public License as published by
        the Free Software Foundation, either version 3 of the License, or
        (at your option) any later version.
    
    
        QGROUNDCONTROL is distributed in the hope that it will be useful,
    
    pixhawk's avatar
    pixhawk committed
        but WITHOUT ANY WARRANTY; without even the implied warranty of
        MERCHANTABILITY or FITNESS FOR A PARTICULAR PURPOSE.  See the
        GNU General Public License for more details.
    
        You should have received a copy of the GNU General Public License
    
        along with QGROUNDCONTROL. If not, see <http://www.gnu.org/licenses/>.
    
    pixhawk's avatar
    pixhawk committed
    
    ======================================================================*/
    
    /**
     * @file
     *   @brief Definition of Unmanned Aerial Vehicle object
     *
     *   @author Lorenz Meier <mavteam@student.ethz.ch>
     *
     */
    
    #ifndef _UAS_H_
    #define _UAS_H_
    
    #include "UASInterface.h"
    #include "MG.h"
    
    #include <MAVLinkProtocol.h>
    
    pixhawk's avatar
    pixhawk committed
    #include "QGCMAVLink.h"
    
    lm's avatar
    lm committed
    #include "QGCFlightGearLink.h"
    
    pixhawk's avatar
    pixhawk committed
    
    /**
     * @brief A generic MAVLINK-connected MAV/UAV
     *
     * This class represents one vehicle. It can be used like the real vehicle, e.g. a call to halt()
     * will automatically send the appropriate messages to the vehicle. The vehicle state will also be
     * automatically updated by the comm architecture, so when writing code to e.g. control the vehicle
     * no knowledge of the communication infrastructure is needed.
     */
    
    class UAS : public UASInterface
    {
    
    pixhawk's avatar
    pixhawk committed
        Q_OBJECT
    public:
    
        UAS(MAVLinkProtocol* protocol, int id = 0);
    
    pixhawk's avatar
    pixhawk committed
        ~UAS();
    
    
        enum BatteryType {
    
    pixhawk's avatar
    pixhawk committed
            NICD = 0,
            NIMH = 1,
            LIION = 2,
            LIPOLY = 3,
            LIFE = 4,
            AGZN = 5
    
        }; ///< The type of battery used
    
    pixhawk's avatar
    pixhawk committed
    
        static const int lipoFull = 4.2f;  ///< 100% charged voltage
        static const int lipoEmpty = 3.5f; ///< Discharged voltage
    
        /* MANAGEMENT */
    
        /** @brief The name of the robot */
    
        /** @brief Get short state */
        const QString& getShortState() const;
        /** @brief Get short mode */
        const QString& getShortMode() const;
    
        /** @brief Translate from mode id to text */
        static QString getShortModeTextFor(int id);
    
    pixhawk's avatar
    pixhawk committed
        /** @brief Get the unique system id */
    
        /** @brief Get the airframe */
    
        int getAirframe() const {
            return airframe;
        }
    
    LM's avatar
    LM committed
        /** @brief Get the components */
        QMap<int, QString> getComponents();
    
    
    pixhawk's avatar
    pixhawk committed
        /** @brief The time interval the robot is switched on */
    
    pixhawk's avatar
    pixhawk committed
        /** @brief Get the status flag for the communication */
    
        int getCommunicationStatus() const;
    
    pixhawk's avatar
    pixhawk committed
        /** @brief Add one measurement and get low-passed voltage */
    
        float filterVoltage(float value) const;
    
    pixhawk's avatar
    pixhawk committed
        /** @brief Get the links associated with this robot */
        QList<LinkInterface*>* getLinks();
    
    
    LM's avatar
    LM committed
        double getLocalX() const
        {
    
            return localX;
        }
    
    LM's avatar
    LM committed
        double getLocalY() const
        {
    
            return localY;
        }
    
    LM's avatar
    LM committed
        double getLocalZ() const
        {
    
            return localZ;
        }
        double getLatitude() const {
            return latitude;
        }
        double getLongitude() const {
            return longitude;
        }
        double getAltitude() const {
            return altitude;
        }
    
        virtual bool localPositionKnown() const
        {
            return isLocalPositionKnown;
        }
        virtual bool globalPositionKnown() const
        {
            return isGlobalPositionKnown;
        }
    
    
        double getRoll() const {
            return roll;
        }
        double getPitch() const {
            return pitch;
        }
        double getYaw() const {
            return yaw;
        }
    
    #ifdef QGC_PROTOBUF_ENABLED
        px::PointCloudXYZRGB getPointCloud() const {
            return pointCloud;
        }
    
    
        px::RGBDImage getRGBDImage() const {
            return rgbdImage;
        }
    
    
        px::ObstacleList getObstacleList() const {
            return obstacleList;
        }
    
    
        px::Path getPath() const {
            return path;
        }
    
        friend class UASWaypointManager;
    
    INIDETAM's avatar
    INIDETAM committed
    protected: //COMMENTS FOR TEST UNIT
    
        unsigned char type;           ///< UAS type (from type enum)
    
    pixhawk's avatar
    pixhawk committed
        quint64 startTime;            ///< The time the UAS was switched on
        CommStatus commStatus;        ///< Communication status
        QString name;                 ///< Human-friendly name of the vehicle, e.g. bravo
    
        int autopilot;                ///< Type of the Autopilot: -1: None, 0: Generic, 1: PIXHAWK, 2: SLUGS, 3: Ardupilot (up to 15 types), defined in MAV_AUTOPILOT_TYPE ENUM
    
    pixhawk's avatar
    pixhawk committed
        QList<LinkInterface*>* links; ///< List of links this UAS can be reached by
    
        QList<int> unknownPackets;    ///< Packet IDs which are unknown and have been received
    
        MAVLinkProtocol* mavlink;     ///< Reference to the MAVLink instance
    
    pixhawk's avatar
    pixhawk committed
        BatteryType batteryType;      ///< The battery type
        int cells;                    ///< Number of cells
    
    pixhawk's avatar
    pixhawk committed
    
    
        UASWaypointManager waypointManager;
    
    
    pixhawk's avatar
    pixhawk committed
        QList<double> actuatorValues;
        QList<QString> actuatorNames;
    
        QList<double> motorValues;
        QList<QString> motorNames;
    
    LM's avatar
    LM committed
        QMap<int, QString> components;  ///< IDs and names of all detected onboard components
    
    pixhawk's avatar
    pixhawk committed
    
    
    pixhawk's avatar
    pixhawk committed
        double thrustSum;           ///< Sum of forward/up thrust of all thrust actuators, in Newtons
        double thrustMax;           ///< Maximum forward/up thrust of this vehicle, in Newtons
    
    pixhawk's avatar
    pixhawk committed
    
        // Battery stats
    
        float fullVoltage;          ///< Voltage of the fully charged battery (100%)
        float emptyVoltage;         ///< Voltage of the empty battery (0%)
        float startVoltage;         ///< Voltage at system start
    
        float warnVoltage;          ///< Voltage where QGC will start to warn about low battery
    
        float warnLevelPercent;     ///< Warning level, in percent
    
    pixhawk's avatar
    pixhawk committed
        double currentVoltage;      ///< Voltage currently measured
        float lpVoltage;            ///< Low-pass filtered voltage
    
        bool batteryRemainingEstimateEnabled; ///< If the estimate is enabled, QGC will try to estimate the remaining battery life
        float chargeLevel;          ///< Charge level of battery, in percent
    
    pixhawk's avatar
    pixhawk committed
        int timeRemaining;          ///< Remaining time calculated based on previous and current
    
    LM's avatar
    LM committed
        uint8_t mode;                   ///< The current mode of the MAV
    
    pixhawk's avatar
    pixhawk committed
        int status;                 ///< The current status of the MAV
    
        uint32_t navMode;                ///< The current navigation mode of the MAV
    
    pixhawk's avatar
    pixhawk committed
        quint64 onboardTimeOffset;
    
    
    pixhawk's avatar
    pixhawk committed
        bool controlRollManual;     ///< status flag, true if roll is controlled manually
        bool controlPitchManual;    ///< status flag, true if pitch is controlled manually
        bool controlYawManual;      ///< status flag, true if yaw is controlled manually
        bool controlThrustManual;   ///< status flag, true if thrust is controlled manually
    
        double manualRollAngle;     ///< Roll angle set by human pilot (radians)
        double manualPitchAngle;    ///< Pitch angle set by human pilot (radians)
        double manualYawAngle;      ///< Yaw angle set by human pilot (radians)
        double manualThrust;        ///< Thrust set by human pilot (radians)
    
    lm's avatar
    lm committed
        float receiveDropRate;      ///< Percentage of packets that were dropped on the MAV's receiving link (from GCS and other MAVs)
        float sendDropRate;         ///< Percentage of packets that were not received from the MAV by the GCS
    
    lm's avatar
    lm committed
        bool lowBattAlarm;          ///< Switch if battery is low
    
        bool positionLock;          ///< Status if position information is available or not
    
    lm's avatar
    lm committed
        double localX;
        double localY;
        double localZ;
    
        double latitude;
        double longitude;
        double altitude;
    
        double speedX;              ///< True speed in X axis
        double speedY;              ///< True speed in Y axis
        double speedZ;              ///< True speed in Z axis
    
    lm's avatar
    lm committed
        double roll;
        double pitch;
        double yaw;
    
        quint64 lastHeartbeat;      ///< Time of the last heartbeat message
    
        QTimer* statusTimeout;      ///< Timer for various status timeouts
    
    
        int imageSize;              ///< Image size being transmitted (bytes)
        int imagePackets;           ///< Number of data packets being sent for this image
        int imagePacketsArrived;    ///< Number of data packets recieved
        int imagePayload;           ///< Payload size per transmitted packet (bytes). Standard is 254, and decreases when image resolution increases.
    
    LM's avatar
    LM committed
        int imageQuality;           ///< Quality of the transmitted image (percentage)
        int imageType;              ///< Type of the transmitted image (BMP, PNG, JPEG, RAW 8 bit, RAW 32 bit)
    
    LM's avatar
    LM committed
        int imageWidth;             ///< Width of the image stream
        int imageHeight;            ///< Width of the image stream
    
        QByteArray imageRecBuffer;  ///< Buffer for the incoming bytestream
        QImage image;               ///< Image data of last completely transmitted image
        quint64 imageStart;
    
    
    #ifdef QGC_PROTOBUF_ENABLED
        px::PointCloudXYZRGB pointCloud;
    
        QMap<int, QMap<QString, QVariant>* > parameters; ///< All parameters
    
    lm's avatar
    lm committed
        bool paramsOnceRequested;       ///< If the parameter list has been read at least once
        int airframe;                   ///< The airframe type
        bool attitudeKnown;             ///< True if attitude was received, false else
    
        QGCUASParamManager* paramManager; ///< Parameter manager class
    
    lm's avatar
    lm committed
        QString shortStateText;         ///< Short textual state description
        QString shortModeText;          ///< Short textual mode description
        bool attitudeStamped;           ///< Should arriving data be timestamped with the last attitude? This helps with broken system time clocks on the MAV
        quint64 lastAttitude;           ///< Timestamp of last attitude measurement
        QGCFlightGearLink* simulation;  ///< Hardware in the loop simulation link
        bool isLocalPositionKnown;      ///< If the local position has been received for this MAV
        bool isGlobalPositionKnown;     ///< If the global position has been received for this MAV
    
        bool systemIsArmed;             ///< If the system is armed
    
    public:
    
    pixhawk's avatar
    pixhawk committed
        /** @brief Set the current battery type */
        void setBattery(BatteryType type, int cells);
        /** @brief Estimate how much flight time is remaining */
        int calculateTimeRemaining();
        /** @brief Get the current charge level */
    
        float getChargeLevel();
    
    pixhawk's avatar
    pixhawk committed
        /** @brief Get the human-readable status message for this code */
        void getStatusForCode(int statusCode, QString& uasState, QString& stateDescription);
    
        /** @brief Get the human-readable navigation mode translation for this mode */
        QString getNavModeText(int mode);
    
    pixhawk's avatar
    pixhawk committed
        /** @brief Check if vehicle is in autonomous mode */
        bool isAuto();
    
        /** @brief Check if vehicle is armed */
        bool isArmed() const { return systemIsArmed; }
    
    pixhawk's avatar
    pixhawk committed
    
    
        UASWaypointManager* getWaypointManager() {
            return &waypointManager;
        }
    
        /** @brief Get reference to the param manager **/
    
        QGCUASParamManager* getParamManager() const {
            return paramManager;
        }
    
        // TODO Will be removed
        /** @brief Set reference to the param manager **/
    
        void setParamManager(QGCUASParamManager* manager) {
            paramManager = manager;
        }
    
    lm's avatar
    lm committed
        QString getSystemTypeName()
        {
            switch(type)
            {
            case MAV_TYPE_GENERIC:
                return "GENERIC";
                break;
            case MAV_TYPE_FIXED_WING:
                return "FIXED_WING";
                break;
            case MAV_TYPE_QUADROTOR:
                return "QUADROTOR";
                break;
            case MAV_TYPE_COAXIAL:
                return "COAXIAL";
                break;
            case MAV_TYPE_HELICOPTER:
                return "HELICOPTER";
                break;
            case MAV_TYPE_ANTENNA_TRACKER:
                return "ANTENNA_TRACKER";
                break;
            case MAV_TYPE_GCS:
                return "GCS";
                break;
            case MAV_TYPE_AIRSHIP:
                return "AIRSHIP";
                break;
            case MAV_TYPE_FREE_BALLOON:
                return "FREE_BALLOON";
                break;
            case MAV_TYPE_ROCKET:
                return "ROCKET";
                break;
            case MAV_TYPE_GROUND_ROVER:
                return "GROUND_ROVER";
                break;
            case MAV_TYPE_SURFACE_BOAT:
                return "BOAT";
                break;
            case MAV_TYPE_SUBMARINE:
                return "SUBMARINE";
                break;
            case MAV_TYPE_HEXAROTOR:
                return "HEXAROTOR";
                break;
            case MAV_TYPE_OCTOROTOR:
                return "OCTOROTOR";
                break;
            case MAV_TYPE_TRICOPTER:
                return "TRICOPTER";
                break;
            case MAV_TYPE_FLAPPING_WING:
                return "FLAPPING_WING";
                break;
            default:
                return "";
                break;
            }
        }
    
    
        QImage getImage();
    
        int getAutopilotType() {
            return autopilot;
        }
    
    lm's avatar
    lm committed
        QString getAutopilotTypeName()
        {
            switch (autopilot)
            {
            case MAV_AUTOPILOT_GENERIC:
                return "GENERIC";
                break;
            case MAV_AUTOPILOT_PIXHAWK:
                return "PIXHAWK";
                break;
            case MAV_AUTOPILOT_SLUGS:
                return "SLUGS";
                break;
            case MAV_AUTOPILOT_ARDUPILOTMEGA:
                return "ARDUPILOTMEGA";
                break;
            case MAV_AUTOPILOT_OPENPILOT:
                return "OPENPILOT";
                break;
    
    lm's avatar
    lm committed
            case MAV_AUTOPILOT_GENERIC_WAYPOINTS_ONLY:
                return "GENERIC_WAYPOINTS_ONLY";
    
    lm's avatar
    lm committed
                break;
    
    lm's avatar
    lm committed
            case MAV_AUTOPILOT_GENERIC_WAYPOINTS_AND_SIMPLE_NAVIGATION_ONLY:
    
    lm's avatar
    lm committed
                return "GENERIC_MISSION_NAVIGATION_ONLY";
                break;
            case MAV_AUTOPILOT_GENERIC_MISSION_FULL:
                return "GENERIC_MISSION_FULL";
                break;
            case MAV_AUTOPILOT_INVALID:
                return "NO AP";
                break;
            case MAV_AUTOPILOT_PPZ:
                return "PPZ";
                break;
            case MAV_AUTOPILOT_UDB:
                return "UDB";
                break;
            case MAV_AUTOPILOT_FP:
                return "FP";
                break;
            default:
                return "";
                break;
            }
        }
    
    pixhawk's avatar
    pixhawk committed
    public slots:
    
        /** @brief Set the autopilot type */
    
    lm's avatar
    lm committed
        void setAutopilotType(int apType)
        {
    
            autopilot = apType;
            emit systemSpecsChanged(uasId);
        }
    
        /** @brief Set the type of airframe */
    
        void setSystemType(int systemType);
    
        /** @brief Set the specific airframe type */
    
    lm's avatar
    lm committed
        void setAirframe(int airframe)
        {
    
            this->airframe = airframe;
            emit systemSpecsChanged(uasId);
        }
    
        /** @brief Set a new name **/
        void setUASName(const QString& name);
    
    lm's avatar
    lm committed
        /** @brief Executes a command **/
        void executeCommand(MAV_CMD command);
    
        /** @brief Executes a command with 7 params */
        void executeCommand(MAV_CMD command, int confirmation, float param1, float param2, float param3, float param4, float param5, float param6, float param7, int component);
    
        /** @brief Set the current battery type and voltages */
        void setBatterySpecs(const QString& specs);
        /** @brief Get the current battery type and specs */
        QString getBatterySpecs();
    
    pixhawk's avatar
    pixhawk committed
        /** @brief Launches the system **/
        void launch();
    
    lm's avatar
    lm committed
        /** @brief Write this waypoint to the list of waypoints */
    
        //void setWaypoint(Waypoint* wp); FIXME tbd
    
    lm's avatar
    lm committed
        /** @brief Set currently active waypoint */
    
        //void setWaypointActive(int id); FIXME tbd
    
    pixhawk's avatar
    pixhawk committed
        /** @brief Order the robot to return home / to land on the runway **/
        void home();
        void halt();
        void go();
    
    lm's avatar
    lm committed
    
        /** @brief Enable / disable HIL */
        void enableHil(bool enable);
    
        /** @brief Send the full HIL state to the MAV */
    
        void sendHilState(	uint64_t time_us, float roll, float pitch, float yaw, float rollspeed,
                            float pitchspeed, float yawspeed, int32_t lat, int32_t lon, int32_t alt,
                            int16_t vx, int16_t vy, int16_t vz, int16_t xacc, int16_t yacc, int16_t zacc);
    
    
        /** @brief Places the UAV in Hardware-in-the-Loop simulation status **/
        void startHil();
    
        /** @brief Stops the UAV's Hardware-in-the-Loop simulation status **/
        void stopHil();
    
    
    
    pixhawk's avatar
    pixhawk committed
        /** @brief Stops the robot system. If it is an MAV, the robot starts the emergency landing procedure **/
        void emergencySTOP();
    
        /** @brief Kills the robot. All systems are immediately shut down (e.g. the main power line is cut). This might lead to a crash **/
        bool emergencyKILL();
    
        /** @brief Shut the system cleanly down. Will shut down any onboard computers **/
        void shutdown();
    
    
        /** @brief Set the target position for the robot to navigate to. */
        void setTargetPosition(float x, float y, float z, float yaw);
    
    
    lm's avatar
    lm committed
        void startLowBattAlarm();
        void stopLowBattAlarm();
    
    
        /** @brief Arm system */
        void armSystem();
    
    pixhawk's avatar
    pixhawk committed
        /** @brief Disable the motors */
    
        void disarmSystem();
    
    pixhawk's avatar
    pixhawk committed
    
        /** @brief Set the values for the manual control of the vehicle */
        void setManualControlCommands(double roll, double pitch, double yaw, double thrust);
        /** @brief Receive a button pressed event from an input device, e.g. joystick */
        void receiveButton(int buttonIndex);
    
    
    pixhawk's avatar
    pixhawk committed
        /** @brief Add a link associated with this robot */
    
    pixhawk's avatar
    pixhawk committed
        void addLink(LinkInterface* link);
    
        /** @brief Remove a link associated with this robot */
        void removeLink(QObject* object);
    
    pixhawk's avatar
    pixhawk committed
    
        /** @brief Receive a message from one of the communication links. */
    
        virtual void receiveMessage(LinkInterface* link, mavlink_message_t message);
    
    pixhawk's avatar
    pixhawk committed
    
    
    #ifdef QGC_PROTOBUF_ENABLED
        /** @brief Receive a message from one of the communication links. */
        virtual void receiveExtendedMessage(LinkInterface* link, std::tr1::shared_ptr<google::protobuf::Message> message);
    #endif
    
    
    pixhawk's avatar
    pixhawk committed
        /** @brief Send a message over this link (to this or to all UAS on this link) */
        void sendMessage(LinkInterface* link, mavlink_message_t message);
        /** @brief Send a message over all links this UAS can be reached with (!= all links) */
        void sendMessage(mavlink_message_t message);
    
    
        /** @brief Temporary Hack for sending packets to patch Antenna. Send a message over all serial links except for this UAS's */
        void forwardMessage(mavlink_message_t message);
    
    
    pixhawk's avatar
    pixhawk committed
        /** @brief Set this UAS as the system currently in focus, e.g. in the main display widgets */
        void setSelected();
    
        /** @brief Set current mode of operation, e.g. auto or manual */
    
    pixhawk's avatar
    pixhawk committed
        void setMode(int mode);
    
    pixhawk's avatar
    pixhawk committed
    
    
        /** @brief Request all parameters */
        void requestParameters();
    
    
        /** @brief Request a single parameter by name */
    
        void requestParameter(int component, const QString& parameter);
    
        /** @brief Request a single parameter by index */
    
        void requestParameter(int component, int id);
    
        /** @brief Set a system parameter */
    
        void setParameter(const int component, const QString& id, const QVariant& value);
    
    
        /** @brief Write parameters to permanent storage */
    
        void writeParametersToStorage();
        /** @brief Read parameters from permanent storage */
        void readParametersFromStorage();
    
        /** @brief Get the names of all parameters */
        QList<QString> getParameterNames(int component);
    
        /** @brief Get the ids of all components */
        QList<int> getComponentIds();
    
    
    James Goppert's avatar
    James Goppert committed
        void enableAllDataTransmission(int rate);
        void enableRawSensorDataTransmission(int rate);
        void enableExtendedSystemStatusTransmission(int rate);
        void enableRCChannelDataTransmission(int rate);
        void enableRawControllerDataTransmission(int rate);
    
    lm's avatar
    lm committed
        //void enableRawSensorFusionTransmission(int rate);
    
    James Goppert's avatar
    James Goppert committed
        void enablePositionTransmission(int rate);
        void enableExtra1Transmission(int rate);
        void enableExtra2Transmission(int rate);
        void enableExtra3Transmission(int rate);
    
    lm's avatar
    lm committed
    
    
        /** @brief Update the system state */
        void updateState();
    
    
        /** @brief Set world frame origin at current GPS position */
        void setLocalOriginAtCurrentGPSPosition();
    
    lm's avatar
    lm committed
        /** @brief Set world frame origin / home position at this GPS position */
        void setHomePosition(double lat, double lon, double alt);
    
    pixhawk's avatar
    pixhawk committed
        /** @brief Set local position setpoint */
        void setLocalPositionSetpoint(float x, float y, float z, float yaw);
    
    pixhawk's avatar
    pixhawk committed
        /** @brief Add an offset in body frame to the setpoint */
        void setLocalPositionOffset(float x, float y, float z, float yaw);
    
        void startRadioControlCalibration();
        void startMagnetometerCalibration();
        void startGyroscopeCalibration();
        void startPressureCalibration();
    
    pixhawk's avatar
    pixhawk committed
    
    
    lm's avatar
    lm committed
        void startDataRecording();
        void stopDataRecording();
    
    
    pixhawk's avatar
    pixhawk committed
    signals:
    
        /** @brief The main/battery voltage has changed/was updated */
    
        //void voltageChanged(int uasId, double voltage); // Defined in UASInterface already
    
    pixhawk's avatar
    pixhawk committed
        /** @brief An actuator value has changed */
    
        //void actuatorChanged(UASInterface*, int actId, double value); // Defined in UASInterface already
    
    pixhawk's avatar
    pixhawk committed
        /** @brief An actuator value has changed */
        void actuatorChanged(UASInterface* uas, QString actuatorName, double min, double max, double value);
        void motorChanged(UASInterface* uas, QString motorName, double min, double max, double value);
        /** @brief The system load (MCU/CPU usage) changed */
        void loadChanged(UASInterface* uas, double load);
        /** @brief Propagate a heartbeat received from the system */
    
        //void heartbeat(UASInterface* uas); // Defined in UASInterface already
    
        /** @brief A new camera image has arrived */
        void imageReady(UASInterface* uas);
    
        /** @brief Point cloud data has been changed */
        void pointCloudChanged(UASInterface* uas);
        /** @brief RGBD image data has been changed */
        void rgbdImageChanged(UASInterface* uas);
    
        /** @brief Obstacle list data has been changed */
        void obstacleListChanged(UASInterface* uas);
    
        /** @brief Path data has been changed */
        void pathChanged(UASInterface* uas);
    
    lm's avatar
    lm committed
        /** @brief HIL controls have changed */
        void hilControlsChanged(uint64_t time, float rollAilerons, float pitchElevator, float yawRudder, float throttle, uint8_t systemMode, uint8_t navMode);
    
        /** @brief Get the UNIX timestamp in milliseconds, enter microseconds */
    
        quint64 getUnixTime(quint64 time=0);
    
        /** @brief Get the UNIX timestamp in milliseconds, enter milliseconds */
        quint64 getUnixTimeFromMs(quint64 time);
    
    LM's avatar
    LM committed
        /** @brief Get the UNIX timestamp in milliseconds, ignore attitudeStamped mode */
        quint64 getUnixReferenceTime(quint64 time);
    
        int componentID[256];
        bool componentMulti[256];
    
        /** @brief Write settings to disk */
        void writeSettings();
        /** @brief Read settings from disk */
        void readSettings();
    
    //    // MESSAGE RECEPTION
    //    /** @brief Receive a named value message */
    //    void receiveMessageNamedValue(const mavlink_message_t& message);
    
    //    unsigned int mode;          ///< The current mode of the MAV
    
    pixhawk's avatar
    pixhawk committed
    };
    
    
    #endif // _UAS_H_