ardupilot/libraries/AP_DDS/AP_DDS_ExternalControl.h
Andrew Tridgell 847c7980c7 AP_DDS: use AP_ExternalControl for velocity control
Signed-off-by: Ryan Friedman <ryanfriedman5410+github@gmail.com>
Co-authored-by: Andrew Tridgell <tridge60@gmail.com>
2023-08-22 18:21:23 +10:00

12 lines
228 B
C++

#pragma once
#if AP_DDS_ENABLED
#include "geometry_msgs/msg/TwistStamped.h"
class AP_DDS_External_Control
{
public:
static bool handle_velocity_control(geometry_msgs_msg_TwistStamped& cmd_vel);
};
#endif // AP_DDS_ENABLED