8 #include <std_msgs/Int32.h> 10 #include "qemotoruser.h" 22 CQEMotorUser &
motor = CQEMotorUser::GetRef();
26 int speed = motor13_msg.data;
27 printf(
"Received subscribed motor speed %d\n", speed);
28 motor.SetPWM(0, speed);
Subscriber subscribe(const std::string &topic, uint32_t queue_size, void(T::*fp)(M), T *obj, const TransportHints &transport_hints=TransportHints())