AutoAPMS
Resilient Robot Mission Management
|
This is the complete list of members for VehicleCommandClient, including all inherited members.
ACCEPTED enum value | VehicleCommandClient | |
Arm() const | VehicleCommandClient | |
Disarm() const | VehicleCommandClient | |
FlightMode enum name | VehicleCommandClient | |
Land() const | VehicleCommandClient | |
REJECTED enum value | VehicleCommandClient | |
SendCommandResult enum name | VehicleCommandClient | |
StartMission() const | VehicleCommandClient | |
SyncActivateFlightMode(uint8_t mode_id) const | VehicleCommandClient | |
SyncActivateFlightMode(const FlightMode &mode) const | VehicleCommandClient | |
SyncActivateFlightMode(const px4_ros2::ModeBase *const mode_ptr) const | VehicleCommandClient | |
SyncSendVehicleCommand(uint32_t command, float param1=NAN, float param2=NAN, float param3=NAN, float param4=NAN, float param5=NAN, float param6=NAN, float param7=NAN) const | VehicleCommandClient | |
SyncSendVehicleCommand(const VehicleCommand &cmd) const | VehicleCommandClient | |
Takeoff(float altitude_amsl_m, float heading_rad=NAN) const | VehicleCommandClient | |
TIMEOUT enum value | VehicleCommandClient | |
VehicleCommandClient(rclcpp::Node &node, const std::chrono::milliseconds &command_timeout=std::chrono::milliseconds(500)) | VehicleCommandClient | explicit |