#include <ros/ros.h>#include <sensor_msgs/JointState.h>#include <std_msgs/Float32.h>#include <std_msgs/Empty.h>#include <std_msgs/Int8.h>#include <icl_core/EnumHelper.h>#include <stdlib.h>#include <time.h>
Go to the source code of this file.
Functions | |
| void | loopCallback (const std_msgs::Float32ConstPtr &msg) | 
| int | main (int argc, char **argv) | 
| void | runCallback (const std_msgs::Empty &) | 
| void | speedCallback (const std_msgs::Float32ConstPtr &msg) | 
Variables | |
| double | loop_rate = 50 | 
| bool | running = true | 
| double | sin_duration = 10 | 
This file contains a very very simple test node that will generate a sin movement for slected fingers of the Schunk Five finger hand. It is only meant to be used as a quick test and demo program to use the Schunk five finger hand and test its operation.
Definition in file SVHSinTest.cpp.
| void loopCallback | ( | const std_msgs::Float32ConstPtr & | msg | ) | 
Definition at line 66 of file SVHSinTest.cpp.
| int main | ( | int | argc, | 
| char ** | argv | ||
| ) | 
Prefix for the driver to identify joint names if the Driver should expext "left_hand_Pinky" than the prefix is left_hand
Definition at line 75 of file SVHSinTest.cpp.
| void runCallback | ( | const std_msgs::Empty & | ) | 
Definition at line 58 of file SVHSinTest.cpp.
| void speedCallback | ( | const std_msgs::Float32ConstPtr & | msg | ) | 
Definition at line 63 of file SVHSinTest.cpp.
| double loop_rate = 50 | 
Definition at line 46 of file SVHSinTest.cpp.
| bool running = true | 
Definition at line 53 of file SVHSinTest.cpp.
| double sin_duration = 10 | 
Definition at line 49 of file SVHSinTest.cpp.