Namespaces | Defines | Functions
box_detection_node.cpp File Reference
#include <tedusar_box_detection/box_detection_node.h>
#include <iostream>
#include <sstream>
#include <boost/algorithm/string.hpp>
#include <boost/bind.hpp>
#include <boost/make_shared.hpp>
#include <pcl/common/common.h>
#include <pcl/common/pca.h>
#include <pcl/conversions.h>
#include <pcl/filters/extract_indices.h>
#include <pcl/filters/voxel_grid.h>
#include <pcl/segmentation/sac_segmentation.h>
#include <pcl/segmentation/extract_clusters.h>
#include <pcl/surface/convex_hull.h>
#include <pcl_conversions/pcl_conversions.h>
#include <pcl_ros/transforms.h>
#include <moveit_msgs/CollisionObject.h>
#include <visualization_msgs/MarkerArray.h>
Include dependency graph for box_detection_node.cpp:

Go to the source code of this file.

Namespaces

namespace  tedusar_box_detection

Defines

#define GOP(key, default_value)   getOptionalParameter(private_nh, #key, parameters_.key##_, default_value)
#define GRP(key)   getRequiredParameter(private_nh, #key, parameters_.key##_)

Functions

int main (int argc, char **argv)
static bool operator<= (const Eigen::Vector3f &v1, const Eigen::Vector3f &v2)

Define Documentation

#define GOP (   key,
  default_value 
)    getOptionalParameter(private_nh, #key, parameters_.key##_, default_value)
#define GRP (   key)    getRequiredParameter(private_nh, #key, parameters_.key##_)

Function Documentation

int main ( int  argc,
char **  argv 
)

Definition at line 502 of file box_detection_node.cpp.

static bool operator<= ( const Eigen::Vector3f &  v1,
const Eigen::Vector3f &  v2 
) [static]

Definition at line 59 of file box_detection_node.cpp.



tedusar_box_detection
Author(s):
autogenerated on Wed Aug 26 2015 16:30:42