This is the complete list of members for
fcu::FlightController, including all inherited members.
| arm(const bool arm) | fcu::FlightController | |
| arm_block() | fcu::FlightController | |
| box_name_ids | fcu::FlightController | [private] |
| channel_map | fcu::FlightController | [private] |
| client | fcu::FlightController | [private] |
| disarm_block() | fcu::FlightController | |
| enableRxMSP() | fcu::FlightController | [inline] |
| firmware | fcu::FlightController | [private] |
| FlightController(const std::string &device, const uint baudrate=115200) | fcu::FlightController | |
| getBoxNames() | fcu::FlightController | [inline] |
| getSubscription(const msp::ID &id) | fcu::FlightController | [inline] |
| hasAccelerometer() const | fcu::FlightController | [inline] |
| hasBarometer() const | fcu::FlightController | [inline] |
| hasBind() const | fcu::FlightController | [inline] |
| hasCapability(const msp::msg::Capability &cap) const | fcu::FlightController | [inline] |
| hasDynBal() const | fcu::FlightController | [inline] |
| hasFlap() const | fcu::FlightController | [inline] |
| hasGPS() const | fcu::FlightController | [inline] |
| hasMagnetometer() const | fcu::FlightController | [inline] |
| hasSensor(const msp::msg::Sensor &sensor) const | fcu::FlightController | [inline] |
| hasSonar() const | fcu::FlightController | [inline] |
| hasSubscription(const msp::ID &id) | fcu::FlightController | [inline] |
| ident | fcu::FlightController | [private] |
| initBoxes() | fcu::FlightController | |
| initialise() | fcu::FlightController | |
| isArmed() | fcu::FlightController | [inline] |
| isFirmware(const FirmwareType firmware_type) | fcu::FlightController | |
| isFirmwareCleanflight() | fcu::FlightController | [inline] |
| isFirmwareMultiWii() | fcu::FlightController | [inline] |
| isStatusActive(const std::string &status_name) | fcu::FlightController | |
| isStatusFailsafe() | fcu::FlightController | [inline] |
| MAX_MAPPABLE_RX_INPUTS | fcu::FlightController | [private, static] |
| reboot() | fcu::FlightController | |
| request(msp::Request &request, const double timeout=0) | fcu::FlightController | [inline] |
| request_raw(const uint8_t id, msp::ByteVector &data, const double timeout=0) | fcu::FlightController | [inline] |
| respond(const msp::Response &response, const bool wait_ack=true) | fcu::FlightController | [inline] |
| respond_raw(const uint8_t id, msp::ByteVector &data, const bool wait_ack=true) | fcu::FlightController | [inline] |
| sendRequest(const uint8_t id) | fcu::FlightController | [inline] |
| sensors | fcu::FlightController | [private] |
| setMotors(const std::array< uint16_t, msp::msg::N_MOTOR > &motor_values) | fcu::FlightController | |
| setRc(const uint16_t roll, const uint16_t pitch, const uint16_t yaw, const uint16_t throttle, const uint16_t aux1=1000, const uint16_t aux2=1000, const uint16_t aux3=1000, const uint16_t aux4=1000, const std::vector< uint16_t > auxs=std::vector< uint16_t >()) | fcu::FlightController | |
| setRc(const std::vector< uint16_t > channels) | fcu::FlightController | |
| subscribe(void(C::*callback)(const T &), C *context, const double tp=0.0) | fcu::FlightController | [inline] |
| updateFeatures(const std::set< std::string > &add=std::set< std::string >(), const std::set< std::string > &remove=std::set< std::string >()) | fcu::FlightController | |
| waitForConnection() | fcu::FlightController | |
| writeEEPROM() | fcu::FlightController | |
| ~FlightController() | fcu::FlightController | |