Go to the documentation of this file.
35 #ifndef JOYSTICKDEMO_H_
36 #define JOYSTICKDEMO_H_
39 #include <sensor_msgs/Joy.h>
40 #include <std_msgs/Empty.h>
42 #include <dbw_fca_msgs/ThrottleCmd.h>
43 #include <dbw_fca_msgs/BrakeCmd.h>
44 #include <dbw_fca_msgs/SteeringCmd.h>
45 #include <dbw_fca_msgs/GearCmd.h>
58 bool joy_throttle_valid;
66 void recvJoy(
const sensor_msgs::Joy::ConstPtr&
msg);
ros::Publisher pub_disable_
ros::Publisher pub_turn_signal_
ros::Publisher pub_brake_
ros::Publisher pub_steering_
void recvJoy(const sensor_msgs::Joy::ConstPtr &msg)
ros::Publisher pub_enable_
float last_steering_filt_output_
ros::Publisher pub_throttle_
void cmdCallback(const ros::TimerEvent &event)
JoystickDemo(ros::NodeHandle &node, ros::NodeHandle &priv_nh)