|
void | _buildGroupFromGraphMap (IntegerGraphMap graph_map, const int from_index, std::vector< int > &to_indices, std::set< int > &output_set) |
|
pcl::PointIndices::Ptr | addIndices (const pcl::PointIndices &a, const pcl::PointIndices &b) |
|
std::vector< int > | addIndices (const std::vector< int > &a, const std::vector< int > &b) |
|
void | addSet (std::set< T > &output, const std::set< T > &new_set) |
|
Eigen::Affine3f | affineFromYAMLNode (const YAML::Node &pose) |
|
void | appendVector (std::vector< T > &a, const std::vector< T > &b) |
|
jsk_recognition_msgs::BoundingBox | boundingBoxFromPointCloud (const pcl::PointCloud< PointT > &cloud) |
|
cv::Rect | boundingRectOfMaskImage (const cv::Mat &image) |
|
void | buildAllGroupsSetFromGraphMap (IntegerGraphMap graph_map, std::vector< std::set< int > > &output_sets) |
|
void | buildGroupFromGraphMap (IntegerGraphMap graph_map, const int from_index, std::vector< int > &to_indices, std::set< int > &output_set) |
|
std_msgs::ColorRGBA | colorCategory20 (int i) |
|
cv::Scalar | colorROSToCVBGR (const std_msgs::ColorRGBA &ros_color) |
|
cv::Scalar | colorROSToCVRGB (const std_msgs::ColorRGBA &ros_color) |
|
bool | compareHistogram (const std::vector< float > &input, const std::vector< float > &reference, const ComparePolicy policy, double &distance) |
|
bool | compareHistogramWithRangeBin (const jsk_recognition_msgs::HistogramWithRangeBin &left, const jsk_recognition_msgs::HistogramWithRangeBin &right) |
|
void | computeColorHistogram1d (const pcl::PointCloud< pcl::PointXYZHSV > &cloud, std::vector< float > &histogram, const int bin_size, const double white_threshold=0.1, const double black_threshold=0.1) |
|
void | computeColorHistogram2d (const pcl::PointCloud< pcl::PointXYZHSV > &cloud, std::vector< float > &histogram, const int bin_size_per_channel, const double white_threshold=0.1, const double black_threshold=0.1) |
|
cv::MatND | computeHistogram (const cv::Mat &input_image, int bin_size, float min_value, float max_value, const cv::Mat &mask_image) |
|
void | convertEigenAffine3 (const Eigen::Affine3d &from, Eigen::Affine3f &to) |
|
void | convertEigenAffine3 (const Eigen::Affine3f &from, Eigen::Affine3d &to) |
|
void | convertEigenAffine3 (const Eigen::Affine3f &from, Eigen::Affine3f &to) |
|
void | convertMatrix4 (const FromT &from, ToT &to) |
|
std::vector< Plane::Ptr > | convertToPlanes (std::vector< pcl::ModelCoefficients::Ptr >) |
|
std::vector< typename pcl::PointCloud< PointT >::Ptr > | convertToPointCloudArray (const typename pcl::PointCloud< PointT >::Ptr &cloud, const std::vector< pcl::PointIndices::Ptr > &indices) |
|
pcl::PointCloud< pcl::PointXYZ >::Ptr | convertToXYZCloud (const pcl::PointCloud< T > &cloud) |
|
ConvexPolygon::Ptr | convexFromCoefficientsAndInliers (const typename pcl::PointCloud< PointT >::Ptr cloud, const pcl::PointIndices::Ptr inliers, const pcl::ModelCoefficients::Ptr coefficients) |
|
void | cropPointCloud (const typename pcl::PointCloud< PointT >::Ptr &cloud, const jsk_recognition_msgs::BoundingBox &bbox_msg, std::vector< int > *indices, bool extract_removed_indices=false) |
|
std::vector< jsk_recognition_msgs::HistogramWithRangeBin > | cvMatNDToHistogramWithRangeBinArray (const cv::MatND &cv_hist, float min_value, float max_value) |
|
void | drawHistogramWithRangeBin (cv::Mat &image, const jsk_recognition_msgs::HistogramWithRangeBin &bin, float min_width_value, float max_width_value, float max_height_value, cv::Scalar color) |
|
int | getHistogramBin (const double &val, const int &step, const double &min, const double &max) |
|
cv::Vec3d | getRGBColor (const int color) |
|
bool | hasField (const std::string &field_name, const sensor_msgs::PointCloud2 &msg) |
|
cv::MatND | HistogramWithRangeBinArrayTocvMatND (const std::vector< jsk_recognition_msgs::HistogramWithRangeBin > &histogram) |
|
void | HSV2HLS (const pcl::PointXYZHSV &hsv, PointXYZHLS &hls) |
|
bool | isBGR (const std::string &encoding) |
|
bool | isBGRA (const std::string &encoding) |
|
bool | isRGB (const std::string &encoding) |
|
bool | isRGBA (const std::string &encoding) |
|
bool | isSameFrameId (const std::string &a, const std::string &b) |
|
bool | isSameFrameId (const std_msgs::Header &a, const std_msgs::Header &b) |
|
bool | isSameFrameId (const T1 &a, const T2 &b) |
|
bool | isValidPoint (const pcl::PointXYZ &p) |
|
bool | isValidPoint (const PointT &p) |
|
void | labelToRGB (const cv::Mat src, cv::Mat &dst) |
|
tf::StampedTransform | lookupTransformWithDuration (tf::TransformListener *listener, const std::string &to_frame, const std::string &from_frame, const ros::Time &stamp, ros::Duration duration) |
|
void | markerMsgToPointCloud (const visualization_msgs::Marker &input_marker, int sample_nums, pcl::PointCloud< PointT > &output_cloud) |
|
void | normalizeHistogram (std::vector< float > &histogram) |
|
std::ostream & | operator<< (std::ostream &os, const PolyLine &pl) |
|
std::ostream & | operator<< (std::ostream &os, const Segment &seg) |
|
Vertices | pointCloudToVertices (const pcl::PointCloud< PointT > &cloud) |
|
void | pointFromVectorToVector (const FromT &from, ToT &to) |
|
void | pointFromVectorToXYZ (const FromT &p, ToT &msg) |
|
void | pointFromXYZToVector (const FromT &msg, ToT &p) |
|
void | pointFromXYZToXYZ (const FromT &from, ToT &to) |
|
std::vector< cv::Point > | project3DPointstoPixel (const image_geometry::PinholeCameraModel &model, const Vertices &vertices) |
|
cv::Point | project3DPointToPixel (const image_geometry::PinholeCameraModel &model, const Eigen::Vector3f &p) |
|
void | publishPointIndices (ros::Publisher &pub, const pcl::PointIndices &indices, const std_msgs::Header &header) |
|
double | randomGaussian (double mean, double var, boost::mt19937 &gen) |
|
double | randomUniform (double min, double max, boost::mt19937 &gen) |
|
void | rangeImageToCvMat (const pcl::RangeImage &range_image, cv::Mat &mat) |
|
void | rotateHistogram1d (const std::vector< float > &input, std::vector< float > &output, const double degree) |
|
void | rotateHistogram2d (const std::vector< float > &input, std::vector< float > &output, const double degree) |
|
Eigen::Quaternionf | rotFrom3Axis (const Eigen::Vector3f &ex, const Eigen::Vector3f &ey, const Eigen::Vector3f &ez) |
|
void | sortHistogramWithRangeBinArray (std::vector< jsk_recognition_msgs::HistogramWithRangeBin > &bins) |
|
pcl::PointIndices::Ptr | subIndices (const pcl::PointIndices &a, const pcl::PointIndices &b) |
|
std::vector< int > | subIndices (const std::vector< int > &a, const std::vector< int > &b) |
|
std::vector< jsk_recognition_msgs::HistogramWithRangeBin > | topNHistogramWithRangeBins (const std::vector< jsk_recognition_msgs::HistogramWithRangeBin > &bins, double top_n_rate) |
|
pcl::PointCloud< PointT >::Ptr | verticesToPointCloud (const Vertices &v) |
|