#include "graspit_interface/ros_graspit_interface.h"
#include <boost/foreach.hpp>
#include <cmath>
#include <Inventor/actions/SoGetBoundingBoxAction.h>
#include <src/DBase/DBPlanner/ros_database_manager.h>
#include <string>
#include <vector>
#include <utility>
#include <set>
#include <list>
#include <QObject>
#include <Inventor/nodes/SoSeparator.h>
#include <Inventor/Qt/viewers/SoQtExaminerViewer.h>
#include "model.h"
#include "task.h"
#include "grasp.h"
#include "DBPlanner/model.h"
#include <math.h>
#include <string.h>
#include <iostream>
#include <stack>
#include <Inventor/SbLinear.h>
#include <Inventor/nodes/SoTransform.h>
#include <ostream>
#include "search.h"
#include "matvec3D.h"
#include <qmessagebox.h>
#include <qpixmap.h>
#include <QString>
#include <QTextStream>
#include <Inventor/SoType.h>
#include "collisionStructures.h"
#include <Inventor/SbBasic.h>
#include <qstring.h>
#include <qwidget.h>
#include "material.h"
#include <map>
#include "mytools.h"
#include "worldElement.h"
#include "body.h"
#include <sensor_msgs/PointCloud.h>
#include <sensor_msgs/PointCloud2.h>
Go to the source code of this file.
Namespaces | |
namespace | graspit_interface |
Functions | |
bool | graspit_interface::biggerThanSbVec3f (const SbVec3f &b1, const SbVec3f &b2) |
void | graspit_interface::getSbBoxDimension (SbBox3f &bbx, vec3 &dimension) |
template<typename T > | |
T | mean (const std::vector< T > &input) |
transf | graspit_interface::poseToTransf (const geometry_msgs::Pose &pose) |
void | graspit_interface::randomPoseGenerate (SbBox3f &bb_space, geometry_msgs::Pose &grasp_random_pose) |
double | graspit_interface::randomUniformReal (double min, double max) |
bool | graspit_interface::smallerThanSbVec3f (const SbVec3f &b1, const SbVec3f &b2) |
template<typename T > | |
T | stddev (const std::vector< T > &input) |
geometry_msgs::Pose | graspit_interface::transfToPose (const transf &tr) |
T mean | ( | const std::vector< T > & | input | ) | [inline] |
Definition at line 57 of file ros_graspit_interface.cpp.
T stddev | ( | const std::vector< T > & | input | ) | [inline] |
Definition at line 69 of file ros_graspit_interface.cpp.