#include <stdio.h>
#include <stdlib.h>
#include <time.h>
#include <ros/ros.h>
#include <pr2_arm_kinematics/pr2_arm_ik_solver.h>
#include <string>
#include <map>
#include <ctype.h>
#include <string.h>
#include <assert.h>
#include "tinystr.h"
#include <boost/function.hpp>
#include "link.h"
#include "Core"
#include "chain.hpp"
#include "frames.hpp"
#include "framevel.hpp"
#include "frameacc.hpp"
#include "jntarray.hpp"
#include "jntarrayvel.hpp"
#include "jntarrayacc.hpp"
#include <urdf/model.h>
#include <Eigen/Array>
#include "src/Core/util/DisableMSVCWarnings.h"
#include "src/misc/Solve.h"
#include "src/misc/Kernel.h"
#include "src/misc/Image.h"
#include "src/LU/FullPivLU.h"
#include "src/LU/PartialPivLU.h"
#include "src/LU/Determinant.h"
#include "src/LU/Inverse.h"
#include "src/Core/util/EnableMSVCWarnings.h"
#include <kdl/chainiksolver.hpp>
#include <vector>
#include <algorithm>
#include <cmath>
#include "utilities/kdl-config.h"
#include "utilities/utility.h"
Go to the source code of this file.
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, inverseKinematicsSearch) | |
TEST (PR2ArmIK, inverseKinematics) | |
TEST (PR2ArmIK, initialize) |
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.
bool NOT_NEAR | ( | const double & | v1, | |
const double & | v2, | |||
const double & | NEAR | |||
) |
Definition at line 71 of file test_ik_regress.cpp.
TEST | ( | PR2ArmIK | , | |
inverseKinematicsSearch | ||||
) |
Definition at line 149 of file test_ik_regress.cpp.
TEST | ( | PR2ArmIK | , | |
inverseKinematics | ||||
) |
Definition at line 78 of file test_ik_regress.cpp.
TEST | ( | PR2ArmIK | , | |
initialize | ||||
) |
Definition at line 58 of file test_ik_regress.cpp.