00001 00009 #ifndef CURRENT_LOGGER_H 00010 #define CURRENT_LOGGER_H 00011 00012 #include <iostream> 00013 #include <fstream> 00014 #include <ros/ros.h> 00015 #include <sensor_msgs/JointState.h> 00016 00017 class CurrentLogger 00018 { 00019 public: 00023 CurrentLogger(); 00024 00025 private: 00026 ros::NodeHandle n; 00027 00028 ros::Subscriber armJointStateSubscriber; 00029 00030 std::string filename; 00031 00037 void armJointStateCallback(const sensor_msgs::JointState::ConstPtr& msg); 00038 }; 00039 00040 int main(int argc, char **argv); 00041 00042 #endif