#include <boost/date_time.hpp>
#include <trac_ik/trac_ik.hpp>
#include <ros/ros.h>
#include <kdl/chainiksolverpos_nr_jl.hpp>
Go to the source code of this file.
Functions | |
double | fRand (double min, double max) |
int | main (int argc, char **argv) |
void | test (ros::NodeHandle &nh, double num_samples, std::string chain_start, std::string chain_end, double timeout, std::string urdf_param) |
double fRand | ( | double | min, |
double | max | ||
) |
Definition at line 36 of file ik_tests.cpp.
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 164 of file ik_tests.cpp.
void test | ( | ros::NodeHandle & | nh, |
double | num_samples, | ||
std::string | chain_start, | ||
std::string | chain_end, | ||
double | timeout, | ||
std::string | urdf_param | ||
) |
Definition at line 43 of file ik_tests.cpp.