moveit2
The MoveIt Motion Planning Framework for ROS 2.
Public Attributes | List of all members
kinematics_cache::KinematicsCache::Options Struct Reference

#include <kinematics_cache.h>

Public Attributes

geometry_msgs::Point origin
 
std::array< double, 3 > workspace_size
 
std::array< double, 3 > resolution
 
unsigned int max_solutions_per_grid_location
 

Detailed Description

Definition at line 51 of file kinematics_cache.h.

Member Data Documentation

◆ max_solutions_per_grid_location

unsigned int kinematics_cache::KinematicsCache::Options::max_solutions_per_grid_location

Definition at line 56 of file kinematics_cache.h.

◆ origin

geometry_msgs::Point kinematics_cache::KinematicsCache::Options::origin

Definition at line 53 of file kinematics_cache.h.

◆ resolution

std::array< double, 3 > kinematics_cache::KinematicsCache::Options::resolution

Definition at line 55 of file kinematics_cache.h.

◆ workspace_size

std::array< double, 3 > kinematics_cache::KinematicsCache::Options::workspace_size

Definition at line 54 of file kinematics_cache.h.


The documentation for this struct was generated from the following file: