#include <map>
#include <string>
#include <vector>
#include <math.h>
#include <pluginlib/class_loader.h>
#include <hand_kinematics/hand_kinematics_plugin.h>
#include <gtest/gtest.h>
#include <sr_utilities/sr_math_utils.hpp>
Go to the source code of this file.
|
int | main (int argc, char **argv) |
|
double | rand_range (double min_n, double max_n) |
|
void | random_test_finger_fkik (std::string PREFIX, std::string prefix, int n_tests, bool verbose=false) |
|
| TEST (FKIK, first_finger) |
|
| TEST (FKIK, middle_finger) |
|
| TEST (FKIK, ring_finger) |
|
| TEST (FKIK, little_finger) |
|
| TEST (FKIK, thumb) |
|
#define DEG2RAD (M_PI / 180.0) |
#define RAD2DEG (180.0 / M_PI) |
int main |
( |
int |
argc, |
|
|
char ** |
argv |
|
) |
| |
interface and selftest (fk==ik) of the forward/inverse kinematics solver for the Shadow hand with J1/J2 finger-couplings, for the Shadow hand thumb, and support for little-finger palm-arch (LFJ5). The solvers start at the "palm" frame and work towards idealized "fftip" "mftip" "rftip" "lftip" and "thtip" frames, which are approximations to the core of the fingertips (assuming spherical fingertip shape). Actual contact points on the fingertips are therefore about one-half finger radius outside of the positions specified by the *tip frames.
Definition at line 346 of file test_kinematics_as_service.cpp.
double rand_range |
( |
double |
min_n, |
|
|
double |
max_n |
|
) |
| |
void random_test_finger_fkik |
( |
std::string |
PREFIX, |
|
|
std::string |
prefix, |
|
|
int |
n_tests, |
|
|
bool |
verbose = false |
|
) |
| |
TEST |
( |
FKIK |
, |
|
|
first_finger |
|
|
) |
| |
TEST |
( |
FKIK |
, |
|
|
middle_finger |
|
|
) |
| |
TEST |
( |
FKIK |
, |
|
|
ring_finger |
|
|
) |
| |
TEST |
( |
FKIK |
, |
|
|
little_finger |
|
|
) |
| |