A ROS node used to subscribe to the tf topic on which the reverse kinematics targets are published. Those targets are then transformed into a pose and sent to the arm_kinematics node which tries to compute the reverse kinematics. On success, the computed targets are then sent to the arm and to the hand. More...
#include <sstream>
#include <algorithm>
#include <sensor_msgs/JointState.h>
#include <kdl_parser/kdl_parser.hpp>
#include <kdl/jntarray.hpp>
#include <sr_hand/sr_kinematics.h>
#include <sr_hand/sendupdate.h>
#include <sr_hand/joint.h>
Go to the source code of this file.
Namespaces | |
namespace | shadowrobot |
Functions | |
int | main (int argc, char **argv) |
A ROS node used to subscribe to the tf topic on which the reverse kinematics targets are published. Those targets are then transformed into a pose and sent to the arm_kinematics node which tries to compute the reverse kinematics. On success, the computed targets are then sent to the arm and to the hand.
Definition in file sr_kinematics.cpp.
int main | ( | int | argc, |
char ** | argv | ||
) |
The main function initializes this reverse kinematics ros node and starts the ros spin loop.
argc | |
argv |
Definition at line 256 of file sr_kinematics.cpp.