00001 #include <ros/ros.h> 00002 00003 #include "function.h" 00004 00005 class ESCTest 00006 { 00007 protected: 00008 ros::NodeHandle nh_; 00009 ros::Publisher val_pub_, state_val_pub_; 00010 ros::Subscriber vel_sub_, pos_sub_; 00011 00012 ESCSystem *system_; 00013 std::vector<float> vel_, pos_; 00014 00015 protected: 00016 void velocityCallback(const std_msgs::Float32MultiArray::ConstPtr &msg); 00017 void positionCallback(const std_msgs::Float32MultiArray::ConstPtr &msg); 00018 void publish(); 00019 00020 public: 00021 ESCTest() : nh_("~") 00022 { 00023 } 00024 00025 void init(ESCSystem *system); 00026 void spin(); 00027 };