20 #include <boost/foreach.hpp> 37 unsigned int counter = 0;
44 if (objectTypeSetPtr->find(objectPoint.
type) == objectTypeSetPtr->end()) {
50 for (Indices::iterator iter = begin; iter != end;) {
51 int normalIndex = *iter;
62 std::iter_swap(iter, end);
70 std::size_t iteratorDistance = std::distance(begin, end);
77 objectPoint.
color.r = ratio > .5 ? int((2.0 - 2 * ratio) * 255) : 255;
78 objectPoint.
color.g = ratio > .5 ? 255 : int(2.0 * ratio * 255);
79 objectPoint.
color.b = 0;
SimpleVector3CollectionPtr normal_vectors
Eigen::Matrix< Precision, 3, 1 > SimpleVector3
ObjectPointCloudPtr child_point_cloud
this namespace contains all generally usable classes.
PerspectiveHypothesisUpdater()
static boost::shared_ptr< DebugHelper > getInstance()
std_msgs::ColorRGBA color
SimpleVector3 getPosition() const
DefaultRatingModulePtr getDefaultRatingModule()
DefaultRatingModulePtr mDefaultRatingModulePtr
double getNormalAngleThreshold()
double mNormalAngleThreshold
unsigned int update(const ObjectTypeSetPtr &objectTypeSetPtr, const ViewportPoint &viewportPoint)
Updates the point cloud under the assumption that the given viewport was chosen.
void setNormalAngleThreshold(double angle)
virtual ~PerspectiveHypothesisUpdater()
DebugHelperPtr mDebugHelperPtr
IndicesPtr active_normal_vectors
void setDefaultRatingModule(DefaultRatingModulePtr defaultRatingModulePtr)