Public Member Functions | Public Attributes
moveit_simple_grasps::IkThreadStruct Struct Reference

#include <grasp_filter.h>

List of all members.

Public Member Functions

 IkThreadStruct (std::vector< moveit_msgs::Grasp > &possible_grasps, std::vector< moveit_msgs::Grasp > &filtered_grasps, std::vector< trajectory_msgs::JointTrajectoryPoint > &ik_solutions, Eigen::Affine3d &link_transform, int grasps_id_start, int grasps_id_end, kinematics::KinematicsBaseConstPtr kin_solver, bool filter_pregrasp, std::string ee_parent_link, double timeout, boost::mutex *lock, int thread_id)

Public Attributes

std::string ee_parent_link_
bool filter_pregrasp_
std::vector< moveit_msgs::Grasp > & filtered_grasps_
int grasps_id_end_
int grasps_id_start_
std::vector
< trajectory_msgs::JointTrajectoryPoint > & 
ik_solutions_
kinematics::KinematicsBaseConstPtr kin_solver_
Eigen::Affine3d link_transform_
boost::mutex * lock_
std::vector< moveit_msgs::Grasp > & possible_grasps_
int thread_id_
double timeout_

Detailed Description

Definition at line 67 of file grasp_filter.h.


Constructor & Destructor Documentation

moveit_simple_grasps::IkThreadStruct::IkThreadStruct ( std::vector< moveit_msgs::Grasp > &  possible_grasps,
std::vector< moveit_msgs::Grasp > &  filtered_grasps,
std::vector< trajectory_msgs::JointTrajectoryPoint > &  ik_solutions,
Eigen::Affine3d &  link_transform,
int  grasps_id_start,
int  grasps_id_end,
kinematics::KinematicsBaseConstPtr  kin_solver,
bool  filter_pregrasp,
std::string  ee_parent_link,
double  timeout,
boost::mutex *  lock,
int  thread_id 
) [inline]

Definition at line 69 of file grasp_filter.h.


Member Data Documentation

Definition at line 104 of file grasp_filter.h.

Definition at line 103 of file grasp_filter.h.

Definition at line 97 of file grasp_filter.h.

Definition at line 101 of file grasp_filter.h.

Definition at line 100 of file grasp_filter.h.

std::vector<trajectory_msgs::JointTrajectoryPoint>& moveit_simple_grasps::IkThreadStruct::ik_solutions_

Definition at line 98 of file grasp_filter.h.

kinematics::KinematicsBaseConstPtr moveit_simple_grasps::IkThreadStruct::kin_solver_

Definition at line 102 of file grasp_filter.h.

Definition at line 99 of file grasp_filter.h.

Definition at line 106 of file grasp_filter.h.

Definition at line 96 of file grasp_filter.h.

Definition at line 107 of file grasp_filter.h.

Definition at line 105 of file grasp_filter.h.


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


moveit_simple_grasps
Author(s): Dave Coleman
autogenerated on Thu Jun 6 2019 20:55:20