#include <kinematics_cache.h>
Public Attributes | |
unsigned int | max_solutions_per_grid_location |
geometry_msgs::Point | origin |
boost::array< double, 3 > | resolution |
boost::array< double, 3 > | workspace_size |
Definition at line 52 of file v1/kinematics_cache/include/kinematics_cache/kinematics_cache.h.
unsigned int kinematics_cache::KinematicsCache::Options::max_solutions_per_grid_location |
Definition at line 57 of file v1/kinematics_cache/include/kinematics_cache/kinematics_cache.h.
geometry_msgs::Point kinematics_cache::KinematicsCache::Options::origin |
Definition at line 54 of file v1/kinematics_cache/include/kinematics_cache/kinematics_cache.h.
boost::array< double, 3 > kinematics_cache::KinematicsCache::Options::resolution |
Definition at line 56 of file v1/kinematics_cache/include/kinematics_cache/kinematics_cache.h.
boost::array< double, 3 > kinematics_cache::KinematicsCache::Options::workspace_size |
Definition at line 55 of file v1/kinematics_cache/include/kinematics_cache/kinematics_cache.h.