#include <stdio.h>#include <stdlib.h>#include <time.h>#include <ros/ros.h>#include <pr2_arm_kinematics/pr2_arm_ik_solver.h>#include <pr2_arm_kinematics/pr2_arm_kinematics_utils.h>#include <kdl/chainfksolverpos_recursive.hpp>#include <motion_planning_msgs/ArmNavigationErrorCodes.h>#include <gtest/gtest.h>
Go to the source code of this file.
| Defines | |
| #define | IK_NEAR 1e-4 | 
| #define | IK_NEAR_TRANSLATE 1e-5 | 
| Functions | |
| double | gen_rand (double min, double max) | 
| int | main (int argc, char **argv) | 
| bool | NOT_NEAR (const double &v1, const double &v2, const double &NEAR) | 
| TEST (PR2ArmIK, initialize) | |
| TEST (PR2ArmIK, inverseKinematics) | |
| TEST (PR2ArmIK, inverseKinematicsSearch) | |
| #define IK_NEAR 1e-4 | 
Definition at line 46 of file test_ik_regress.cpp.
| #define IK_NEAR_TRANSLATE 1e-5 | 
Definition at line 47 of file test_ik_regress.cpp.
| double gen_rand | ( | double | min, | 
| double | max | ||
| ) | 
Definition at line 51 of file test_ik_regress.cpp.
| int main | ( | int | argc, | 
| char ** | argv | ||
| ) | 
Definition at line 259 of file test_ik_regress.cpp.
Definition at line 71 of file test_ik_regress.cpp.
| TEST | ( | PR2ArmIK | , | 
| initialize | |||
| ) | 
Definition at line 58 of file test_ik_regress.cpp.
Definition at line 78 of file test_ik_regress.cpp.
Definition at line 149 of file test_ik_regress.cpp.