AutoAPMS
Resilient Robot Mission Management
Loading...
Searching...
No Matches
VehicleCommandClient Member List

This is the complete list of members for VehicleCommandClient, including all inherited members.

ACCEPTED enum valueVehicleCommandClient
Arm() constVehicleCommandClient
Disarm() constVehicleCommandClient
FlightMode enum nameVehicleCommandClient
Land() constVehicleCommandClient
REJECTED enum valueVehicleCommandClient
SendCommandResult enum nameVehicleCommandClient
StartMission() constVehicleCommandClient
SyncActivateFlightMode(uint8_t mode_id) constVehicleCommandClient
SyncActivateFlightMode(const FlightMode &mode) constVehicleCommandClient
SyncActivateFlightMode(const px4_ros2::ModeBase *const mode_ptr) constVehicleCommandClient
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) constVehicleCommandClient
SyncSendVehicleCommand(const VehicleCommand &cmd) constVehicleCommandClient
Takeoff(float altitude_amsl_m, float heading_rad=NAN) constVehicleCommandClient
TIMEOUT enum valueVehicleCommandClient
VehicleCommandClient(rclcpp::Node &node, const std::chrono::milliseconds &command_timeout=std::chrono::milliseconds(500))VehicleCommandClientexplicit