Class GazeboPlatform
Defined in File as2_platform_gazebo.hpp
Inheritance Relationships
Base Type
public as2::AerialPlatform
Class Documentation
-
class GazeboPlatform : public as2::AerialPlatform
Public Functions
-
explicit GazeboPlatform(const rclcpp::NodeOptions &options = rclcpp::NodeOptions())
-
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::Publisher<as2_msgs::msg::Acro>::SharedPtr acro_pub_
-
rclcpp::Subscription<geometry_msgs::msg::TwistStamped>::SharedPtr twist_state_sub_
-
rclcpp::Service<std_srvs::srv::Trigger>::SharedPtr reset_srv_
-
explicit GazeboPlatform(const rclcpp::NodeOptions &options = rclcpp::NodeOptions())