$search

grab_box.cpp File Reference

#include <simple_object_capture/common.h>
#include <simple_object_capture/CaptureConfig.h>
#include <dynamic_reconfigure/server.h>
#include <pcl/features/integral_image_normal.h>
#include <pcl/sample_consensus/method_types.h>
#include <pcl/sample_consensus/model_types.h>
#include <pcl/segmentation/sac_segmentation.h>
#include <pcl/visualization/pcl_visualizer.h>
#include <pcl/kdtree/kdtree_flann.h>
#include <pcl/kdtree/kdtree.h>
#include <pcl/surface/mls.h>
#include <ros/ros.h>
#include <message_filters/subscriber.h>
#include <message_filters/time_synchronizer.h>
#include <message_filters/synchronizer.h>
#include <message_filters/sync_policies/approximate_time.h>
#include <sensor_msgs/PointCloud2.h>
#include <sensor_msgs/Image.h>
#include <sensor_msgs/CameraInfo.h>
#include <geometry_msgs/PoseStamped.h>
#include <opencv2/opencv.hpp>
#include <cv_bridge/cv_bridge.h>
#include <boost/filesystem.hpp>
#include <rosbag/bag.h>
Include dependency graph for grab_box.cpp:

Go to the source code of this file.

Classes

struct  Box
class  GrabBox

Functions

boost::shared_ptr
< pcl::PointIndices
getIndexDifferenceAssumingSortedIndex (const pcl::PointIndices &input, int rows, int cols)
int main (int argc, char **argv)
pcl::PointXYZRGB operator* (const Eigen::Affine3f &t, const pcl::PointXYZRGB &p)
pcl::PointXYZ operator* (const Eigen::Affine3f &t, const pcl::PointXYZ &p)

Variables

static const float CUBE_SIZE = 0.4

Function Documentation

boost::shared_ptr<pcl::PointIndices> getIndexDifferenceAssumingSortedIndex ( const pcl::PointIndices input,
int  rows,
int  cols 
)

Definition at line 31 of file grab_box.cpp.

int main ( int  argc,
char **  argv 
)

Definition at line 521 of file grab_box.cpp.

pcl::PointXYZRGB operator* ( const Eigen::Affine3f &  t,
const pcl::PointXYZRGB &  p 
)

Definition at line 74 of file grab_box.cpp.

pcl::PointXYZ operator* ( const Eigen::Affine3f &  t,
const pcl::PointXYZ &  p 
)

Definition at line 67 of file grab_box.cpp.


Variable Documentation

const float CUBE_SIZE = 0.4 [static]

Definition at line 65 of file grab_box.cpp.

 All Classes Namespaces Files Functions Variables Typedefs Enumerations Properties Friends


simple_object_capture
Author(s): Stuart Glaser
autogenerated on Sat Mar 2 13:37:08 2013