Point Cloud Library (PCL)  1.14.0-dev
pcl::RangeImageSpherical Member List

This is the complete list of members for pcl::RangeImageSpherical, including all inherited members.

angular_resolution_x_pcl::RangeImageprotected
angular_resolution_x_reciprocal_pcl::RangeImageprotected
angular_resolution_y_pcl::RangeImageprotected
angular_resolution_y_reciprocal_pcl::RangeImageprotected
asin_lookup_tablepcl::RangeImageprotectedstatic
asinLookUp(float value)pcl::RangeImageinlineprotectedstatic
assign(index_t count, const PointWithRange &value)pcl::PointCloud< PointWithRange >inline
assign(index_t new_width, index_t new_height, const PointWithRange &value)pcl::PointCloud< PointWithRange >inline
assign(InputIterator first, InputIterator last)pcl::PointCloud< PointWithRange >inline
assign(InputIterator first, InputIterator last, index_t new_width)pcl::PointCloud< PointWithRange >inline
assign(std::initializer_list< PointWithRange > ilist)pcl::PointCloud< PointWithRange >inline
assign(std::initializer_list< PointWithRange > ilist, index_t new_width)pcl::PointCloud< PointWithRange >inline
at(int column, int row) constpcl::PointCloud< PointWithRange >inline
at(int column, int row)pcl::PointCloud< PointWithRange >inline
at(std::size_t n) constpcl::PointCloud< PointWithRange >inline
at(std::size_t n)pcl::PointCloud< PointWithRange >inline
atan2LookUp(float y, float x)pcl::RangeImageinlineprotectedstatic
atan_lookup_tablepcl::RangeImageprotectedstatic
back() constpcl::PointCloud< PointWithRange >inline
back()pcl::PointCloud< PointWithRange >inline
BaseClass typedefpcl::RangeImageSpherical
begin() noexceptpcl::PointCloud< PointWithRange >inline
begin() const noexceptpcl::PointCloud< PointWithRange >inline
calculate3DPoint(float image_x, float image_y, float range, Eigen::Vector3f &point) constpcl::RangeImageSphericalinlinevirtual
calculate3DPoint(float image_x, float image_y, float range, PointWithRange &point) constpcl::RangeImageSphericalinline
calculate3DPoint(float image_x, float image_y, PointWithRange &point) constpcl::RangeImageSphericalinline
calculate3DPoint(float image_x, float image_y, float range, Eigen::Vector3f &point) constpcl::RangeImageSphericalinline
calculate3DPoint(float image_x, float image_y, Eigen::Vector3f &point) constpcl::RangeImageSphericalinline
pcl::RangeImage::calculate3DPoint(float image_x, float image_y, float range, PointWithRange &point) constpcl::RangeImageinline
pcl::RangeImage::calculate3DPoint(float image_x, float image_y, PointWithRange &point) constpcl::RangeImageinline
pcl::RangeImage::calculate3DPoint(float image_x, float image_y, Eigen::Vector3f &point) constpcl::RangeImageinline
CAMERA_FRAME enum valuepcl::RangeImage
cbegin() const noexceptpcl::PointCloud< PointWithRange >inline
cend() const noexceptpcl::PointCloud< PointWithRange >inline
change3dPointsToLocalCoordinateFrame()pcl::RangeImage
checkPoint(const Eigen::Vector3f &point, PointWithRange &point_in_image) constpcl::RangeImageinline
clear()pcl::PointCloud< PointWithRange >inline
CloudVectorType typedefpcl::PointCloud< PointWithRange >
concatenate(pcl::PointCloud< PointWithRange > &cloud1, const pcl::PointCloud< PointWithRange > &cloud2)pcl::PointCloud< PointWithRange >inlinestatic
concatenate(const pcl::PointCloud< PointWithRange > &cloud1, const pcl::PointCloud< PointWithRange > &cloud2, pcl::PointCloud< PointWithRange > &cloud_out)pcl::PointCloud< PointWithRange >inlinestatic
const_iterator typedefpcl::PointCloud< PointWithRange >
const_reference typedefpcl::PointCloud< PointWithRange >
const_reverse_iterator typedefpcl::PointCloud< PointWithRange >
ConstPtr typedefpcl::RangeImageSpherical
CoordinateFrame enum namepcl::RangeImage
copyTo(RangeImage &other) constpcl::RangeImagevirtual
cos_lookup_tablepcl::RangeImageprotectedstatic
cosLookUp(float value)pcl::RangeImageinlineprotectedstatic
crbegin() const noexceptpcl::PointCloud< PointWithRange >inline
createEmpty(float angular_resolution, const Eigen::Affine3f &sensor_pose=Eigen::Affine3f::Identity(), RangeImage::CoordinateFrame coordinate_frame=CAMERA_FRAME, float angle_width=pcl::deg2rad(360.0f), float angle_height=pcl::deg2rad(180.0f))pcl::RangeImage
createEmpty(float angular_resolution_x, float angular_resolution_y, const Eigen::Affine3f &sensor_pose=Eigen::Affine3f::Identity(), RangeImage::CoordinateFrame coordinate_frame=CAMERA_FRAME, float angle_width=pcl::deg2rad(360.0f), float angle_height=pcl::deg2rad(180.0f))pcl::RangeImage
createFromPointCloud(const PointCloudType &point_cloud, float angular_resolution=pcl::deg2rad(0.5f), float max_angle_width=pcl::deg2rad(360.0f), float max_angle_height=pcl::deg2rad(180.0f), const Eigen::Affine3f &sensor_pose=Eigen::Affine3f::Identity(), CoordinateFrame coordinate_frame=CAMERA_FRAME, float noise_level=0.0f, float min_range=0.0f, int border_size=0)pcl::RangeImage
createFromPointCloud(const PointCloudType &point_cloud, float angular_resolution_x=pcl::deg2rad(0.5f), float angular_resolution_y=pcl::deg2rad(0.5f), float max_angle_width=pcl::deg2rad(360.0f), float max_angle_height=pcl::deg2rad(180.0f), const Eigen::Affine3f &sensor_pose=Eigen::Affine3f::Identity(), CoordinateFrame coordinate_frame=CAMERA_FRAME, float noise_level=0.0f, float min_range=0.0f, int border_size=0)pcl::RangeImage
createFromPointCloudWithKnownSize(const PointCloudType &point_cloud, float angular_resolution, const Eigen::Vector3f &point_cloud_center, float point_cloud_radius, const Eigen::Affine3f &sensor_pose=Eigen::Affine3f::Identity(), CoordinateFrame coordinate_frame=CAMERA_FRAME, float noise_level=0.0f, float min_range=0.0f, int border_size=0)pcl::RangeImage
createFromPointCloudWithKnownSize(const PointCloudType &point_cloud, float angular_resolution_x, float angular_resolution_y, const Eigen::Vector3f &point_cloud_center, float point_cloud_radius, const Eigen::Affine3f &sensor_pose=Eigen::Affine3f::Identity(), CoordinateFrame coordinate_frame=CAMERA_FRAME, float noise_level=0.0f, float min_range=0.0f, int border_size=0)pcl::RangeImage
createFromPointCloudWithViewpoints(const PointCloudTypeWithViewpoints &point_cloud, float angular_resolution, float max_angle_width, float max_angle_height, CoordinateFrame coordinate_frame=CAMERA_FRAME, float noise_level=0.0f, float min_range=0.0f, int border_size=0)pcl::RangeImage
createFromPointCloudWithViewpoints(const PointCloudTypeWithViewpoints &point_cloud, float angular_resolution_x, float angular_resolution_y, float max_angle_width, float max_angle_height, CoordinateFrame coordinate_frame=CAMERA_FRAME, float noise_level=0.0f, float min_range=0.0f, int border_size=0)pcl::RangeImage
createLookupTables()pcl::RangeImageprotectedstatic
crend() const noexceptpcl::PointCloud< PointWithRange >inline
cropImage(int border_size=0, int top=-1, int right=-1, int bottom=-1, int left=-1)pcl::RangeImage
data() noexceptpcl::PointCloud< PointWithRange >inline
data() const noexceptpcl::PointCloud< PointWithRange >inline
debugpcl::RangeImagestatic
difference_type typedefpcl::PointCloud< PointWithRange >
doZBuffer(const PointCloudType &point_cloud, float noise_level, float min_range, int &top, int &right, int &bottom, int &left)pcl::RangeImage
emplace(iterator position, Args &&...args)pcl::PointCloud< PointWithRange >inline
emplace_back(Args &&...args)pcl::PointCloud< PointWithRange >inline
empty() constpcl::PointCloud< PointWithRange >inline
end() noexceptpcl::PointCloud< PointWithRange >inline
end() const noexceptpcl::PointCloud< PointWithRange >inline
erase(iterator position)pcl::PointCloud< PointWithRange >inline
erase(iterator first, iterator last)pcl::PointCloud< PointWithRange >inline
extractFarRanges(const pcl::PCLPointCloud2 &point_cloud_data, PointCloud< PointWithViewpoint > &far_ranges)pcl::RangeImagestatic
front() constpcl::PointCloud< PointWithRange >inline
front()pcl::PointCloud< PointWithRange >inline
get1dPointAverage(int x, int y, int delta_x, int delta_y, int no_of_points, PointWithRange &average_point) constpcl::RangeImageinline
getAcutenessValue(const PointWithRange &point1, const PointWithRange &point2) constpcl::RangeImageinline
getAcutenessValue(int x1, int y1, int x2, int y2) constpcl::RangeImageinline
getAcutenessValueImages(int pixel_distance, float *&acuteness_value_image_x, float *&acuteness_value_image_y) constpcl::RangeImage
getAnglesFromImagePoint(float image_x, float image_y, float &angle_x, float &angle_y) constpcl::RangeImageSphericalinline
getAngularResolution() constpcl::RangeImageinline
getAngularResolution(float &angular_resolution_x, float &angular_resolution_y) constpcl::RangeImageinline
getAngularResolutionX() constpcl::RangeImageinline
getAngularResolutionY() constpcl::RangeImageinline
getAverageEuclideanDistance(int x, int y, int offset_x, int offset_y, int max_steps) constpcl::RangeImageinline
getAverageViewPoint(const PointCloudTypeWithViewpoints &point_cloud)pcl::RangeImagestatic
getBlurredImage(int blur_radius, RangeImage &range_image) constpcl::RangeImagevirtual
getBlurredImageUsingIntegralImage(int blur_radius, float *integral_image, int *valid_points_num_image, RangeImage &range_image) constpcl::RangeImage
getCoordinateFrameTransformation(RangeImage::CoordinateFrame coordinate_frame, Eigen::Affine3f &transformation)pcl::RangeImagestatic
getCurvature(int x, int y, int radius, int step_size) constpcl::RangeImageinline
getEigenVector3f(const PointWithRange &point)pcl::RangeImageinlinestatic
getEigenVector3f(int x, int y) constpcl::RangeImageinline
getEigenVector3f(int index) constpcl::RangeImageinline
getEuclideanDistanceSquared(int x1, int y1, int x2, int y2) constpcl::RangeImageinline
getHalfImage(RangeImage &half_image) constpcl::RangeImagevirtual
getImageOffsetX() constpcl::RangeImageinline
getImageOffsetY() constpcl::RangeImageinline
getImagePoint(const Eigen::Vector3f &point, float &image_x, float &image_y, float &range) constpcl::RangeImageSphericalinlinevirtual
getImagePoint(const Eigen::Vector3f &point, float &image_x, float &image_y, float &range) constpcl::RangeImageSphericalinline
getImagePoint(const Eigen::Vector3f &point, int &image_x, int &image_y, float &range) constpcl::RangeImageSphericalinline
getImagePoint(const Eigen::Vector3f &point, float &image_x, float &image_y) constpcl::RangeImageSphericalinline
getImagePoint(const Eigen::Vector3f &point, int &image_x, int &image_y) constpcl::RangeImageSphericalinline
getImagePoint(float x, float y, float z, float &image_x, float &image_y, float &range) constpcl::RangeImageSphericalinline
getImagePoint(float x, float y, float z, float &image_x, float &image_y) constpcl::RangeImageSphericalinline
getImagePoint(float x, float y, float z, int &image_x, int &image_y) constpcl::RangeImageSphericalinline
pcl::RangeImage::getImagePoint(const Eigen::Vector3f &point, int &image_x, int &image_y, float &range) constpcl::RangeImageinline
pcl::RangeImage::getImagePoint(const Eigen::Vector3f &point, float &image_x, float &image_y) constpcl::RangeImageinline
pcl::RangeImage::getImagePoint(const Eigen::Vector3f &point, int &image_x, int &image_y) constpcl::RangeImageinline
pcl::RangeImage::getImagePoint(float x, float y, float z, float &image_x, float &image_y, float &range) constpcl::RangeImageinline
pcl::RangeImage::getImagePoint(float x, float y, float z, float &image_x, float &image_y) constpcl::RangeImageinline
pcl::RangeImage::getImagePoint(float x, float y, float z, int &image_x, int &image_y) constpcl::RangeImageinline
getImagePointFromAngles(float angle_x, float angle_y, float &image_x, float &image_y) constpcl::RangeImageSphericalinline
getImpactAngle(const PointWithRange &point1, const PointWithRange &point2) constpcl::RangeImageinline
getImpactAngle(int x1, int y1, int x2, int y2) constpcl::RangeImageinline
getImpactAngleBasedOnLocalNormal(int x, int y, int radius) constpcl::RangeImageinline
getImpactAngleImageBasedOnLocalNormals(int radius) constpcl::RangeImage
getIntegralImage(float *&integral_image, int *&valid_points_num_image) constpcl::RangeImage
getInterpolatedSurfaceProjection(const Eigen::Affine3f &pose, int pixel_size, float world_size) constpcl::RangeImage
getInterpolatedSurfaceProjection(const Eigen::Vector3f &point, int pixel_size, float world_size) constpcl::RangeImage
getMatrixXfMap(int dim, int stride, int offset)pcl::PointCloud< PointWithRange >inline
getMatrixXfMap(int dim, int stride, int offset) constpcl::PointCloud< PointWithRange >inline
getMatrixXfMap()pcl::PointCloud< PointWithRange >inline
getMatrixXfMap() constpcl::PointCloud< PointWithRange >inline
getMaxAngleSize(const Eigen::Affine3f &viewer_pose, const Eigen::Vector3f &center, float radius)pcl::RangeImageinlinestatic
getMinMaxRanges(float &min_range, float &max_range) constpcl::RangeImage
getNew() constpcl::RangeImageSphericalinlinevirtual
getNormal(int x, int y, int radius, Eigen::Vector3f &normal, int step_size=1) constpcl::RangeImageinline
getNormalBasedAcutenessValue(int x, int y, int radius) constpcl::RangeImageinline
getNormalBasedUprightTransformation(const Eigen::Vector3f &point, float max_dist, Eigen::Affine3f &transformation) constpcl::RangeImage
getNormalForClosestNeighbors(int x, int y, int radius, const PointWithRange &point, int no_of_nearest_neighbors, Eigen::Vector3f &normal, int step_size=1) constpcl::RangeImageinline
getNormalForClosestNeighbors(int x, int y, int radius, const Eigen::Vector3f &point, int no_of_nearest_neighbors, Eigen::Vector3f &normal, Eigen::Vector3f *point_on_plane=nullptr, int step_size=1) constpcl::RangeImageinline
getNormalForClosestNeighbors(int x, int y, Eigen::Vector3f &normal, int radius=2) constpcl::RangeImageinline
getOverlap(const RangeImage &other_range_image, const Eigen::Affine3f &relative_transformation, int search_radius, float max_distance, int pixel_step=1) constpcl::RangeImage
getPoint(int image_x, int image_y) constpcl::RangeImageinline
getPoint(int image_x, int image_y)pcl::RangeImageinline
getPoint(float image_x, float image_y) constpcl::RangeImageinline
getPoint(float image_x, float image_y)pcl::RangeImageinline
getPoint(int image_x, int image_y, Eigen::Vector3f &point) constpcl::RangeImageinline
getPoint(int index, Eigen::Vector3f &point) constpcl::RangeImageinline
getPoint(int index) constpcl::RangeImageinline
getPointNoCheck(int image_x, int image_y) constpcl::RangeImageinline
getPointNoCheck(int image_x, int image_y)pcl::RangeImageinline
getRangeDifference(const Eigen::Vector3f &point) constpcl::RangeImageinline
getRangeImageWithSmoothedSurface(int radius, RangeImage &smoothed_range_image) constpcl::RangeImage
getRangesArray() constpcl::RangeImage
getRotationToViewerCoordinateFrame(const Eigen::Vector3f &point, Eigen::Affine3f &transformation) constpcl::RangeImageinline
getSensorPos() constpcl::RangeImageinline
getSquaredDistanceOfNthNeighbor(int x, int y, int radius, int n, int step_size) constpcl::RangeImageinline
getSubImage(int sub_image_image_offset_x, int sub_image_image_offset_y, int sub_image_width, int sub_image_height, int combine_pixels, RangeImage &sub_image) constpcl::RangeImagevirtual
getSurfaceAngleChange(int x, int y, int radius, float &angle_change_x, float &angle_change_y) constpcl::RangeImageinline
getSurfaceAngleChangeImages(int radius, float *&angle_change_image_x, float *&angle_change_image_y) constpcl::RangeImage
getSurfaceChange(int x, int y, int radius) constpcl::RangeImage
getSurfaceChangeImage(int radius) constpcl::RangeImage
getSurfaceInformation(int x, int y, int radius, const Eigen::Vector3f &point, int no_of_closest_neighbors, int step_size, float &max_closest_neighbor_distance_squared, Eigen::Vector3f &normal, Eigen::Vector3f &mean, Eigen::Vector3f &eigen_values, Eigen::Vector3f *normal_all_neighbors=nullptr, Eigen::Vector3f *mean_all_neighbors=nullptr, Eigen::Vector3f *eigen_values_all_neighbors=nullptr) constpcl::RangeImageinline
getTransformationToRangeImageSystem() constpcl::RangeImageinline
getTransformationToViewerCoordinateFrame(const Eigen::Vector3f &point) constpcl::RangeImageinline
getTransformationToViewerCoordinateFrame(const Eigen::Vector3f &point, Eigen::Affine3f &transformation) constpcl::RangeImageinline
getTransformationToWorldSystem() constpcl::RangeImageinline
getViewingDirection(int x, int y, Eigen::Vector3f &viewing_direction) constpcl::RangeImageinline
getViewingDirection(const Eigen::Vector3f &point, Eigen::Vector3f &viewing_direction) constpcl::RangeImageinline
headerpcl::PointCloud< PointWithRange >
heightpcl::PointCloud< PointWithRange >
image_offset_x_pcl::RangeImageprotected
image_offset_y_pcl::RangeImageprotected
insert(iterator position, const PointWithRange &pt)pcl::PointCloud< PointWithRange >inline
insert(iterator position, std::size_t n, const PointWithRange &pt)pcl::PointCloud< PointWithRange >inline
insert(iterator position, InputIterator first, InputIterator last)pcl::PointCloud< PointWithRange >inline
integrateFarRanges(const PointCloudType &far_ranges)pcl::RangeImage
is_densepcl::PointCloud< PointWithRange >
isInImage(int x, int y) constpcl::RangeImageinline
isMaxRange(int x, int y) constpcl::RangeImageinline
isObserved(int x, int y) constpcl::RangeImageinline
isOrganized() constpcl::PointCloud< PointWithRange >inline
isValid(int x, int y) constpcl::RangeImageinline
isValid(int index) constpcl::RangeImageinline
iterator typedefpcl::PointCloud< PointWithRange >
LASER_FRAME enum valuepcl::RangeImage
lookup_table_sizepcl::RangeImageprotectedstatic
makeShared()pcl::RangeImageSphericalinline
PointCloud< PointWithRange >::makeShared() constpcl::PointCloud< PointWithRange >inline
max_no_of_threadspcl::RangeImagestatic
max_size() const noexceptpcl::PointCloud< PointWithRange >inline
operator()(std::size_t column, std::size_t row) constpcl::PointCloud< PointWithRange >inline
operator()(std::size_t column, std::size_t row)pcl::PointCloud< PointWithRange >inline
operator+(const PointCloud &rhs)pcl::PointCloud< PointWithRange >inline
operator+=(const PointCloud &rhs)pcl::PointCloud< PointWithRange >inline
operator[](std::size_t n) constpcl::PointCloud< PointWithRange >inline
operator[](std::size_t n)pcl::PointCloud< PointWithRange >inline
PointCloud()=defaultpcl::PointCloud< PointWithRange >
PointCloud(const PointCloud< PointWithRange > &pc, const Indices &indices)pcl::PointCloud< PointWithRange >inline
PointCloud(std::uint32_t width_, std::uint32_t height_, const PointWithRange &value_=PointWithRange())pcl::PointCloud< PointWithRange >inline
pointspcl::PointCloud< PointWithRange >
PointType typedefpcl::PointCloud< PointWithRange >
Ptr typedefpcl::RangeImageSpherical
push_back(const PointWithRange &pt)pcl::PointCloud< PointWithRange >inline
RangeImage()pcl::RangeImage
RangeImageSpherical()pcl::RangeImageSphericalinline
rbegin() noexceptpcl::PointCloud< PointWithRange >inline
rbegin() const noexceptpcl::PointCloud< PointWithRange >inline
real2DToInt2D(float x, float y, int &xInt, int &yInt) constpcl::RangeImageinline
recalculate3DPointPositions()pcl::RangeImage
reference typedefpcl::PointCloud< PointWithRange >
rend() noexceptpcl::PointCloud< PointWithRange >inline
rend() const noexceptpcl::PointCloud< PointWithRange >inline
reserve(std::size_t n)pcl::PointCloud< PointWithRange >inline
reset()pcl::RangeImage
resize(std::size_t count)pcl::PointCloud< PointWithRange >inline
resize(uindex_t new_width, uindex_t new_height)pcl::PointCloud< PointWithRange >inline
resize(index_t count, const PointWithRange &value)pcl::PointCloud< PointWithRange >inline
resize(index_t new_width, index_t new_height, const PointWithRange &value)pcl::PointCloud< PointWithRange >inline
reverse_iterator typedefpcl::PointCloud< PointWithRange >
sensor_orientation_pcl::PointCloud< PointWithRange >
sensor_origin_pcl::PointCloud< PointWithRange >
setAngularResolution(float angular_resolution)pcl::RangeImageinline
setAngularResolution(float angular_resolution_x, float angular_resolution_y)pcl::RangeImageinline
setImageOffsets(int offset_x, int offset_y)pcl::RangeImageinline
setTransformationToRangeImageSystem(const Eigen::Affine3f &to_range_image_system)pcl::RangeImageinline
setUnseenToMaxRange()pcl::RangeImage
size() constpcl::PointCloud< PointWithRange >inline
size_type typedefpcl::PointCloud< PointWithRange >
swap(PointCloud< PointWithRange > &rhs)pcl::PointCloud< PointWithRange >inline
to_range_image_system_pcl::RangeImageprotected
to_world_system_pcl::RangeImageprotected
transient_emplace(iterator position, Args &&...args)pcl::PointCloud< PointWithRange >inline
transient_emplace_back(Args &&...args)pcl::PointCloud< PointWithRange >inline
transient_erase(iterator position)pcl::PointCloud< PointWithRange >inline
transient_erase(iterator first, iterator last)pcl::PointCloud< PointWithRange >inline
transient_insert(iterator position, const PointWithRange &pt)pcl::PointCloud< PointWithRange >inline
transient_insert(iterator position, std::size_t n, const PointWithRange &pt)pcl::PointCloud< PointWithRange >inline
transient_insert(iterator position, InputIterator first, InputIterator last)pcl::PointCloud< PointWithRange >inline
transient_push_back(const PointWithRange &pt)pcl::PointCloud< PointWithRange >inline
unobserved_pointpcl::RangeImageprotected
value_type typedefpcl::PointCloud< PointWithRange >
VectorOfEigenVector3f typedefpcl::RangeImage
VectorType typedefpcl::PointCloud< PointWithRange >
widthpcl::PointCloud< PointWithRange >
~RangeImage()=defaultpcl::RangeImagevirtual
~RangeImageSpherical()=defaultpcl::RangeImageSphericalvirtual