$search
#include <ros/ros.h>#include <planning_environment/models/collision_models.h>#include <kinematics_base/kinematics_base.h>#include <pluginlib/class_loader.h>
Go to the source code of this file.
Classes | |
| class | IkPluginBakeoff |
Functions | |
| double | gen_rand (double min, double max) |
| geometry_msgs::Quaternion | generateRandomUnitQuaternion () |
| int | main (int argc, char **argv) |
Variables | |
| static const unsigned int | TRIES_MAX = 10 |
| double gen_rand | ( | double | min, | |
| double | max | |||
| ) | [inline] |
Definition at line 40 of file ik_plugin_bakeoff.cpp.
| geometry_msgs::Quaternion generateRandomUnitQuaternion | ( | ) | [inline] |
Definition at line 47 of file ik_plugin_bakeoff.cpp.
| int main | ( | int | argc, | |
| char ** | argv | |||
| ) |
Definition at line 262 of file ik_plugin_bakeoff.cpp.
const unsigned int TRIES_MAX = 10 [static] |
Definition at line 38 of file ik_plugin_bakeoff.cpp.