test_jaco_arm_car_vel.h
Go to the documentation of this file.
00001 //============================================================================
00002 // Name        : Jaco.cpp
00003 // Author      : 
00004 // Version     :
00005 // Copyright   : Your copyright notice
00006 // Description : Hello World in C++, Ansi-style
00007 //============================================================================
00008 
00017 //License File
00018 #include <geometry_msgs/TwistStamped.h>
00019 #include <tf/tf.h>
00020 #include <ros/ros.h>
00021 #include <dynamic_reconfigure/server.h>
00022 #include <jaco_driver/JacoVelocityConfig.h>
00023 #include <std_msgs/String.h>
00024 
00025 
00026 
00027 
00028 
00029 class CartesianVelTest {
00030 public:
00031         CartesianVelTest(ros::NodeHandle nh, std::string JointVelocity);
00032 
00033 private:
00034         void TimerCallback(const ros::TimerEvent&);
00035 
00036         void callback(jaco_driver::JacoVelocityConfig &config, uint32_t level);
00037         ros::Publisher pub;
00038         ros::Timer timer;
00039         dynamic_reconfigure::Server<jaco_driver::JacoVelocityConfig> dr_server;
00040         dynamic_reconfigure::Server<jaco_driver::JacoVelocityConfig>::CallbackType dr_call;
00041 
00042         float x_vel ;
00043         float y_vel ;
00044         float z_vel ;
00045         float rx_vel ;
00046         float ry_vel ;
00047         float rz_vel ;
00048 
00049 };


jaco_driver
Author(s): Jeff Schmidt (Clearpath), Alex Bencz (Clearpath), Matt DeDonato (WPI)
autogenerated on Mon Jan 6 2014 11:23:43