Class GazeboPlatform

Inheritance Relationships

Base Type

  • public as2::AerialPlatform

Class Documentation

class GazeboPlatform : public as2::AerialPlatform

Public Functions

GazeboPlatform()
inline ~GazeboPlatform()
inline void configureSensors()
bool ownSendCommand() override
bool ownSetArmingState(bool state) override
bool ownSetOffboardControl(bool offboard) override
bool ownSetPlatformControlMode(const as2_msgs::msg::ControlMode &msg) override
void ownKillSwitch() override
void ownStopPlatform() override
bool ownTakeoff() override
bool ownLand() override

Public Members

rclcpp::Publisher<geometry_msgs::msg::Twist>::SharedPtr twist_pub_
rclcpp::Publisher<std_msgs::msg::Bool>::SharedPtr arm_pub_
rclcpp::Subscription<geometry_msgs::msg::TwistStamped>::SharedPtr twist_state_sub_