Public Member Functions | |
bool | run_fk (double angles[7], geometry_msgs::PoseStamped &return_pose, std::string link_name) |
bool | run_ik (geometry_msgs::PoseStamped pose, double start_angles[7], double solution[7], std::string link_name) |
bool | run_test () |
TestIKandFK () | |
Private Attributes | |
ros::ServiceClient | fk_client |
ros::ServiceClient | ik_client |
ros::NodeHandle | node |
ros::ServiceClient | query_client |
Definition at line 33 of file ik_test.cpp.
TestIKandFK::TestIKandFK | ( | ) | [inline] |
Definition at line 42 of file ik_test.cpp.
bool TestIKandFK::run_fk | ( | double | angles[7], | |
geometry_msgs::PoseStamped & | return_pose, | |||
std::string | link_name | |||
) | [inline] |
Definition at line 104 of file ik_test.cpp.
bool TestIKandFK::run_ik | ( | geometry_msgs::PoseStamped | pose, | |
double | start_angles[7], | |||
double | solution[7], | |||
std::string | link_name | |||
) | [inline] |
Definition at line 65 of file ik_test.cpp.
bool TestIKandFK::run_test | ( | ) | [inline] |
Definition at line 135 of file ik_test.cpp.
ros::ServiceClient TestIKandFK::fk_client [private] |
Definition at line 38 of file ik_test.cpp.
ros::ServiceClient TestIKandFK::ik_client [private] |
Definition at line 37 of file ik_test.cpp.
ros::NodeHandle TestIKandFK::node [private] |
Definition at line 36 of file ik_test.cpp.
ros::ServiceClient TestIKandFK::query_client [private] |
Definition at line 39 of file ik_test.cpp.