Public Member Functions | Private Member Functions | Private Attributes
moveit_simple_grasps::GraspFilter Class Reference

#include <grasp_filter.h>

List of all members.

Public Member Functions

bool chooseBestGrasp (const std::vector< moveit_msgs::Grasp > &possible_grasps, moveit_msgs::Grasp &chosen)
bool filterGrasps (std::vector< moveit_msgs::Grasp > &possible_grasps, std::vector< trajectory_msgs::JointTrajectoryPoint > &ik_solutions, bool filter_pregrasp, const std::string &ee_parent_link, const std::string &planning_group)
 Choose the 1st grasp that is kinematically feasible.
bool filterNthGrasp (std::vector< moveit_msgs::Grasp > &possible_grasps, int n)
 GraspFilter (robot_state::RobotState robot_state, moveit_visual_tools::MoveItVisualToolsPtr &visual_tools)
 ~GraspFilter ()

Private Member Functions

void filterGraspThread (IkThreadStruct ik_thread_struct)
 Thread for checking part of the possible grasps list.

Private Attributes

std::map< std::string,
std::vector
< kinematics::KinematicsBaseConstPtr > > 
kin_solvers_
robot_state::RobotState robot_state_
bool verbose_
moveit_visual_tools::MoveItVisualToolsPtr visual_tools_

Detailed Description

Definition at line 112 of file grasp_filter.h.


Constructor & Destructor Documentation

moveit_simple_grasps::GraspFilter::GraspFilter ( robot_state::RobotState  robot_state,
moveit_visual_tools::MoveItVisualToolsPtr visual_tools 
)

Definition at line 45 of file grasp_filter.cpp.

Definition at line 54 of file grasp_filter.cpp.


Member Function Documentation

bool moveit_simple_grasps::GraspFilter::chooseBestGrasp ( const std::vector< moveit_msgs::Grasp > &  possible_grasps,
moveit_msgs::Grasp &  chosen 
)

Definition at line 58 of file grasp_filter.cpp.

bool moveit_simple_grasps::GraspFilter::filterGrasps ( std::vector< moveit_msgs::Grasp > &  possible_grasps,
std::vector< trajectory_msgs::JointTrajectoryPoint > &  ik_solutions,
bool  filter_pregrasp,
const std::string &  ee_parent_link,
const std::string &  planning_group 
)

Choose the 1st grasp that is kinematically feasible.

Parameters:
\param
whetherto also check ik feasibility for the pregrasp position
Returns:
true on success

Definition at line 71 of file grasp_filter.cpp.

Thread for checking part of the possible grasps list.

Parameters:

Definition at line 192 of file grasp_filter.cpp.

bool moveit_simple_grasps::GraspFilter::filterNthGrasp ( std::vector< moveit_msgs::Grasp > &  possible_grasps,
int  n 
)

Member Data Documentation

std::map<std::string, std::vector<kinematics::KinematicsBaseConstPtr> > moveit_simple_grasps::GraspFilter::kin_solvers_ [private]

Definition at line 119 of file grasp_filter.h.

robot_state::RobotState moveit_simple_grasps::GraspFilter::robot_state_ [private]

Definition at line 116 of file grasp_filter.h.

Definition at line 124 of file grasp_filter.h.

Definition at line 122 of file grasp_filter.h.


The documentation for this class was generated from the following files:


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