30 #include <dynamic_reconfigure/server.h> 31 #include <geometry_msgs/TwistStamped.h> 36 #include <twist_controller/TwistControllerConfig.h> 69 void reconfigureCallback(
const twist_controller::TwistControllerConfig& config, uint32_t level);
71 std::shared_ptr<dynamic_reconfigure::Server<twist_controller::TwistControllerConfig>>
server_;
virtual ~TwistController()=default
virtual void starting(const ros::Time &time) override
realtime_tools::RealtimeBuffer< geometry_msgs::Twist > command_buffer_
void setCommand(const geometry_msgs::Twist &twist)
std::shared_ptr< dynamic_reconfigure::Server< twist_controller::TwistControllerConfig > > server_
TwistController()=default
virtual bool init(TwistCommandInterface *hw, ros::NodeHandle &n) override
A Cartesian ROS-controller for commanding target twists to a robot.
void reconfigureCallback(const twist_controller::TwistControllerConfig &config, uint32_t level)
void twistCallback(const geometry_msgs::TwistConstPtr &msg)
virtual void update(const ros::Time &, const ros::Duration &) override
ros::Subscriber twist_sub_
TwistCommandHandle handle_