Class CrazyfliePlatform
Defined in File crazyflie_platform.hpp
Inheritance Relationships
Base Type
public as2::AerialPlatform
Class Documentation
-
class CrazyfliePlatform : public as2::AerialPlatform
Public Functions
-
void init()
-
CrazyfliePlatform()
-
explicit CrazyfliePlatform(const std::string &ns)
-
explicit CrazyfliePlatform(const std::string &ns, const std::string &radio_uri)
-
void configureParams(const std::string &radio_uri = "")
-
void configureSensors() override
-
bool ownSetArmingState(bool state) override
-
bool ownSetOffboardControl(bool offboard) override
-
bool ownSetPlatformControlMode(const as2_msgs::msg::ControlMode &msg) override
-
bool ownSendCommand() override
-
inline void ownKillSwitch() override
-
inline void ownStopPlatform() override
-
void listVariables()
-
void pingCB()
-
void onLogIMU(uint32_t time_in_ms, std::vector<double> *values, void*)
-
void onLogOdomOri(uint32_t time_in_ms, std::vector<double> *values, void*)
-
void onLogOdomPos(uint32_t time_in_ms, std::vector<double> *values, void*)
-
void onLogBattery()
-
void onLogRange(uint32_t time_in_ms, std::vector<double> *values, void*)
-
void updateOdom()
-
Eigen::Vector3d quaternion2Euler(geometry_msgs::msg::Quaternion quat)
-
void init()