20 #ifndef DEFAULTVIEWPORTPOINT_HPP_ 21 #define DEFAULTVIEWPORTPOINT_HPP_ 23 #define PCL_NO_PRECOMPILE 25 #include <boost/foreach.hpp> 27 #include <geometry_msgs/Pose.h> 29 #include <pcl/point_types.h> 30 #include <pcl/impl/point_types.hpp> 31 #include <pcl/search/search.h> 32 #include <pcl/search/organized.h> 33 #include <pcl/search/impl/organized.hpp> 34 #include <pcl/search/kdtree.h> 35 #include <pcl/search/impl/kdtree.hpp> 36 #include <pcl/kdtree/kdtree_flann.h> 37 #include <pcl/kdtree/impl/kdtree_flann.hpp> 38 #include <pcl/segmentation/conditional_euclidean_clustering.h> 39 #include <pcl/segmentation/impl/conditional_euclidean_clustering.hpp> 40 #include <pcl/pcl_base.h> 41 #include <pcl/impl/pcl_base.hpp> 89 EIGEN_MAKE_ALIGNED_OPERATOR_NEW
93 qw = pose.orientation.w;
94 qx = pose.orientation.x;
95 qy = pose.orientation.y;
96 qz = pose.orientation.z;
143 qw = orientation.w();
144 qx = orientation.x();
145 qy = orientation.y();
146 qz = orientation.z();
157 BOOST_FOREACH(std::size_t index, *(this->child_indices)) {
161 ObjectTypeSet::iterator iter = std::find(objectTypeSetPtr->begin(), objectTypeSetPtr->end(), point.
type);
162 if (iter != objectTypeSetPtr->end()) {
163 objectTypeIndicesPtr->push_back(index);
175 if (objectTypeIndicesPtr->size() == 0) {
gm::Quaternion getQuaternion() const
void setOrientation(const SimpleQuaternion &orientation)
Eigen::Matrix< Precision, 3, 1 > SimpleVector3
EIGEN_MAKE_ALIGNED_OPERATOR_NEW DefaultViewportPoint(const gm::Pose &pose=gm::Pose())
TFSIMD_FORCE_INLINE const tfScalar & y() const
std::vector< int > Indices
ObjectPointCloudPtr point_cloud
SimpleQuaternion getSimpleQuaternion() const
DefaultScoreContainerPtr score
ObjectPointCloudPtr child_point_cloud
DefaultViewportPoint(const SimpleVector3 &vector, const SimpleQuaternion &orientation=SimpleQuaternion(1.0, 0.0, 0.0, 0.0))
this namespace contains all generally usable classes.
static boost::shared_ptr< DebugHelper > getInstance()
boost::shared_ptr< Indices > IndicesPtr
TFSIMD_FORCE_INLINE const tfScalar & x() const
bool filterObjectPointCloudByTypes(const ObjectTypeSetPtr &objectTypeSetPtr, ViewportPoint &viewportPoint)
filters all the objects in this viewport with one of the given types and puts them in a new viewport...
SimpleVector3 getPosition() const
DefaultViewportPoint ViewportPoint
TFSIMD_FORCE_INLINE const tfScalar & z() const
TFSIMD_FORCE_INLINE const tfScalar & w() const
struct next_best_view::DefaultViewportPoint EIGEN_ALIGN16
ObjectPointCloud::Ptr ObjectPointCloudPtr
DebugHelperPtr mDebugHelperPtr
gm::Point getPoint() const
std::ostream & operator<<(std::ostream &strm, const next_best_view::DefaultViewportPoint &p)
Eigen::Quaternion< Precision > SimpleQuaternion
boost::shared_ptr< DefaultViewportPoint > DefaultViewportPointPtr
ObjectTypeSetPtr object_type_set