Namespaces | Functions
sr_kinematics.cpp File Reference

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>
Include dependency graph for sr_kinematics.cpp:

Go to the source code of this file.

Namespaces

namespace  shadowrobot

Functions

int main (int argc, char **argv)

Detailed Description

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.

Author:
Ugo Cupcic <ugo@shadowrobot.com>, Contact <contact@shadowrobot.com>
Date:
Thu Jul 15 11:54:22 2010

Definition in file sr_kinematics.cpp.


Function Documentation

int main ( int  argc,
char **  argv 
)

The main function initializes this reverse kinematics ros node and starts the ros spin loop.

Parameters:
argc
argv
Returns:

Definition at line 256 of file sr_kinematics.cpp.



sr_hand
Author(s): Ugo Cupcic / ugo@shadowrobot.com, contact@shadowrobot.com
autogenerated on Fri Jan 3 2014 12:03:25