This is the complete list of members for Utils, including all inherited members.
areSameVectors(const Eigen::VectorXd v1, const Eigen::VectorXd v2, double threshold) | Utils | static |
cloudToROSMsg(PointCloudRGB::Ptr cloud, sensor_msgs::PointCloud2 &cloud_msg, const std::string &frameid="world") | Utils | static |
cloudToROSMsg(const pcl::PCLPointCloud2 &cloud, sensor_msgs::PointCloud2 &cloud_msg, const std::string &frameid="world") | Utils | static |
cloudToXYZRGB(PointCloudXYZ::Ptr cloud, PointCloudRGB::Ptr cloud_rgb, int R, int G, int B) | Utils | static |
colorizeCloud(PointCloudRGB::Ptr cloud_rgb, int R, int G, int B) | Utils | static |
computeCloudResolution(PointCloudXYZ::Ptr cloud) | Utils | static |
computeCloudResolution(PointCloudRGB::Ptr cloud) | Utils | static |
extractColFromMatrix(Eigen::MatrixXd &matrix, int col) | Utils | static |
extractRowFromMatrix(Eigen::MatrixXd &matrix, int row) | Utils | static |
findOnMatrix(const Eigen::VectorXd v, const Eigen::MatrixXd m, double threshold) | Utils | static |
findOnVector(double value, const Eigen::VectorXd v, double threshold) | Utils | static |
getNormals(PointCloudRGB::Ptr &cloud, double normal_radius, PointCloudNormal::Ptr &normals) | Utils | static |
getVectorFromNormal(PointCloudNormal::Ptr normal, double idx, Eigen::Vector3f &vector) | Utils | static |
isValidCloud(PointCloudXYZ::Ptr cloud) | Utils | static |
isValidCloud(PointCloudRGB::Ptr cloud) | Utils | static |
isValidCloud(PointCloudNormal::Ptr normals) | Utils | static |
isValidCloudMsg(const sensor_msgs::PointCloud2 &cloud_msg) | Utils | static |
isValidMesh(pcl::PolygonMesh::Ptr mesh) | Utils | static |
isValidTransform(Eigen::Matrix4f transform) | Utils | static |
onePointCloud(PointCloudRGB::Ptr cloud, int size, PointCloudRGB::Ptr one_point_cloud) | Utils | static |
PointCloudNormal typedef | Utils | private |
PointCloudRGB typedef | Utils | private |
PointCloudXYZ typedef | Utils | private |
printMatrix(const Eigen::Ref< const Eigen::MatrixXf > &matrix, const int size) | Utils | static |
printTransform(const Eigen::Matrix4f &transform) | Utils | static |
rotateCloud(PointCloudRGB::Ptr cloud_in, PointCloudRGB::Ptr cloud_out, double roll, double pitch, double yaw) | Utils | static |
searchForSameRows(Eigen::MatrixXd source_m, Eigen::MatrixXd target_m, std::vector< int > &source_indx, std::vector< int > &target_indx) | Utils | static |
setPCpath(const std::string &pointcloud_folder_path) | Utils | static |
translateCloud(PointCloudRGB::Ptr cloud_in, PointCloudRGB::Ptr cloud_out, double x_offset=0, double y_offset=0, double z_offset=0) | Utils | static |
Utils() | Utils | inlineprivate |
~Utils() | Utils | inlineprivate |