00001 00012 #ifndef ROVIO_MOVE_H_ 00013 #define ROVIO_MOVE_H_ 00014 00015 #include <geometry_msgs/Twist.h> 00016 #include <ros/ros.h> 00017 #include <rovio_shared/man_drv.h> 00018 #include <rovio_shared/rovio_http.h> 00019 #include <string> 00020 00027 class move_controller 00028 { 00029 public: 00035 move_controller(); 00036 00042 ~move_controller(); 00043 00049 void update(); 00050 00051 private: 00059 void man_drv_callback(const rovio_shared::man_drv::ConstPtr &msg); 00060 00069 void cmd_vel_callback(const geometry_msgs::Twist::ConstPtr &msg); 00070 00071 std::string host; 00072 rovio_http *rovio; 00073 ros::NodeHandle node; 00075 ros::Subscriber man_drv, cmd_vel; 00077 int drive, speed, rotate; 00078 }; 00079 00087 int main(int argc, char **argv); 00088 00089 #endif