00001 00012 #ifndef ROVIO_TELEOP_H_ 00013 #define ROVIO_TELEOP_H_ 00014 00015 #include <ros/ros.h> 00016 #include <rovio_shared/wav_play.h> 00017 #include <sensor_msgs/Joy.h> 00018 00023 #define ROVIO_WAV "/rovio_shared/rovio_wav" 00024 00029 #define THROTTLE 0.66 00030 00037 class teleop_controller 00038 { 00039 public: 00045 teleop_controller(); 00046 00047 private: 00055 void joy_cback(const sensor_msgs::Joy::ConstPtr& joy); 00056 00057 ros::NodeHandle node; 00059 ros::Publisher cmd_vel; 00060 ros::ServiceClient head_ctrl, wav_play; 00061 ros::Subscriber joy_sub; 00063 std::string rovio_wav; 00064 }; 00065 00073 int main(int argc, char **argv); 00074 00075 #endif