Public Member Functions | |
bool | initialize () |
void | joint_state_callback (const geometry_msgs::Pose &ik_pose, const std::vector< double > &joint_state, int &error_code) |
void | pose_callback (const geometry_msgs::Pose &ik_pose, const std::vector< double > &joint_state, int &error_code) |
Public Attributes | |
kinematics::KinematicsBase * | kinematics_solver |
Definition at line 7 of file test_kinematics_as_plugin.cpp.
bool MyTest::initialize | ( | ) | [inline] |
Definition at line 10 of file test_kinematics_as_plugin.cpp.
void MyTest::joint_state_callback | ( | const geometry_msgs::Pose & | ik_pose, |
const std::vector< double > & | joint_state, | ||
int & | error_code | ||
) | [inline] |
Definition at line 43 of file test_kinematics_as_plugin.cpp.
void MyTest::pose_callback | ( | const geometry_msgs::Pose & | ik_pose, |
const std::vector< double > & | joint_state, | ||
int & | error_code | ||
) | [inline] |
Definition at line 29 of file test_kinematics_as_plugin.cpp.
Definition at line 48 of file test_kinematics_as_plugin.cpp.