如何通过球面投影(Spherical Projection)将点云转换为距离图像(Range Images)

前言

将3维激光点云通过球面投影(Spherical Projection)转换为2维距离图像(Range Images),是自动驾驶应用场景中一种非常常见的点云处理方式。点云转换为距离图像后,通常会被输入给一个2维卷积神经网络去实现目标检测、语义分割等任务。目前采用这种点云处理方式的典型目标检测算法有RangeDet,语义分割算法有SqueezeSegRangeNet++SalsaNext等。在这些文章中,都只给出一个通过球面投影转换到距离图像的最终公式,至于这个公式是怎么来的却没有详细的推导,初看论文的读者可能会比较困惑。本文将对这个投影公式做一定的推导,可能本人理解的也不是很对,欢迎大家批评指正。

图片来源于RangeDet论文

球面投影推导过程

假设有一个m线的旋转扫描式激光雷达,它的垂直视场角FOV被分为上下两个部分:FOV_upFOV_down,通常以FOV_up的数值为正数而FOV_down数值为负数,所以FOV = FOV_up + abs(FOV_down)。激光雷达旋转扫描一周得到的点云相当于是以其自身为中心的空心圆柱体,如果把这个圆柱体展开的话,那么就可以把点云投影到一个图像平面中去,这个图像平面就是距离图像。

在这里插入图片描述

对于一个m线的激光雷达,在扫描的某一时刻会得到m个点,如果旋转一周扫描了n次,那么得到的点云就可以用一个 m × n m \times n m×n的矩阵来表示。那么怎么把3维的点云投影到2维的距离图像平面呢?这就需要用到球面坐标。

图片来源于RangeDet论文

球面坐标用3个参数来表示:距离 r r r,方位角(Azimuth θ \theta θ,天顶角(Zenith ϕ \phi ϕ。通常使用的激光雷达点云中的每个由3维笛卡尔坐标表示的点 ( x , y , z ) (x,y,z) (x,y,z)实际上是从球面坐标系转换而来:

x = r c o s ( ϕ ) c o s ( θ ) y = r c o s ( ϕ ) s i n ( θ ) z = r s i n ( ϕ ) \begin{aligned} x &= r cos(\phi)cos(\theta) \\ y &= r cos(\phi)sin(\theta) \\ z &= r sin(\phi) \end{aligned} xyz=rcos(ϕ)cos(θ)=rcos(ϕ)sin(θ)=rsin(ϕ)

让我们再通过下图来理解一下3维笛卡尔坐标系和球面坐标系之间的关系。

在这里插入图片描述

假设3维笛卡尔坐标系下的点坐标为 ( x 1 , y 1 , z 1 ) (x_{1},y_{1},z_{1}) (x1,y1,z1),那么用球面坐标系可以这样表示该点:

r = x 1 2 + y 1 2 + z 1 2 θ = y a w = − arctan ⁡ ( y 1 x 1 ) ϕ = p i t c h = arcsin ⁡ ( z 1 r ) \begin{aligned} r &= \sqrt{x_{1}^{2}+y_{1}^{2}+z_{1}^{2}} \\ \theta &= yaw = -\arctan (\frac{y_{1}}{x_{1}}) \\ \phi &= pitch = \arcsin (\frac{z_{1}}{r}) \end{aligned} rθϕ=x12+y12+z12 =yaw=arctan(x1y1)=pitch=arcsin(rz1)

如果以x轴方向为前视图的方向把激光雷达旋转扫描一周得到的圆柱体展开后,可以得到一副这样的图像:坐标原点在图像的中心,图像中像素的纵坐标由pitch角投影得到(范围为[FOV_down,FOV_up]),横坐标由yaw角投影得到(范围为 [ − π , π ] [-\pi,\pi] [π,π])。

在这里插入图片描述

由于图像坐标系是以左上角作为坐标原点,所以上面得到的前视图还需要做一下坐标转换,把坐标原点移到左上角去:

y a w = y a w + π p i t c h = F O V _ u p − p i t c h \begin{aligned} yaw &= yaw + \pi \\ pitch &= FOV\_up - pitch \end{aligned} yawpitch=yaw+π=FOV_uppitch

把3维点云投影为2维图像,这种降维操作必然会带来信息损失。为了尽可能减少投影带来的信息损失,我们需要选择合适大小的投影图像。对于一个64线的激光雷达,一般会设置投影图像的高为64,那么图像的宽该如何设置呢?假设激光雷达的水平分辨率为0.35度,那么旋转一周一个激光器最多产生的点数为 360 ÷ 0.35 = 1028 360 \div 0.35 = 1028 360÷0.35=1028。在卷积神经网络中,一般会对输入特征图做多次2倍下采样,所以图像的宽度需要设置为2 n n n次幂,这里可设置为1024

由于不同类型激光雷达的视场角、水平分辨率不同,投影图像的尺寸也会根据需要设置为不同的值,为了适应这些变化,yawpitch还需要进行规范化:

y a w = ( y a w + π ) / 2 π p i t c h = ( F O V _ u p − p i t c h ) / F O V \begin{aligned} yaw &= (yaw + \pi)/2\pi \\ pitch &= (FOV\_up - pitch)/FOV \end{aligned} yawpitch=(yaw+π)/2π=(FOV_uppitch)/FOV

规范化后,再乘以投影图像的宽高,就得到了这个点投影到距离图像的坐标:

( u v ) = ( ( ( y a w + π ) / 2 π ) W ( ( F O V _ u p − p i t c h ) / F O V ) H ) = ( 1 2 ( 1 + y a w / π ) W ( ( F O V − a b s ( F O V _ d o w n ) − p i t c h ) / F O V ) H ) = ( 1 2 [ 1 − arctan ⁡ ( y , x ) / π ] W [ 1 − ( arcsin ⁡ ( z / r ) + a b s ( F O V _ d o w n ) ) / F O V ] H ) \begin{aligned} \begin{pmatrix} u \\ v \end{pmatrix} &= \begin{pmatrix} ((yaw + \pi)/2\pi) W \\ ((FOV\_up - pitch)/FOV) H \end{pmatrix} \\ &= \begin{pmatrix} \frac{1}{2}(1+yaw/\pi) W \\ ((FOV- abs(FOV\_down) - pitch)/FOV) H \end{pmatrix} \\ &= \begin{pmatrix} \frac{1}{2}\left [ 1-\arctan (y,x) / \pi \right ]W \\ \left [ 1-(\arcsin (z/r) + abs(FOV\_down))/FOV \right ]H \end{pmatrix} \end{aligned} (uv)=(((yaw+π)/2π)W((FOV_uppitch)/FOV)H)=(21(1+yaw/π)W((FOVabs(FOV_down)pitch)/FOV)H)=(21[1arctan(y,x)/π]W[1(arcsin(z/r)+abs(FOV_down))/FOV]H)

上式中的第二步是将 F O V _ u p = F O V − a b s ( F O V _ d o w n ) FOV\_up = FOV - abs(FOV\_down) FOV_up=FOVabs(FOV_down)代入得到的。

代码实现

理解了原理后,我们再用代码来把这个投影过程实现一遍。在RangeNet++中,点云被转换为5个通道的距离图像,这5个通道分别代表点云的 r a n g e , x , y , z , i n t e n s i t y range,x,y,z,intensity range,x,y,z,intensity这5个属性。下面的代码将展示如何通过球面投影将点云转换为需要的距离图像,使用的点云数据来源于SemanticKITTI数据集。


#include <pcl/io/pcd_io.h>
#include <pcl/point_types.h>

#include <cmath>
#include <iostream>
#include <memory>
#include <opencv2/opencv.hpp>
#include <string>
#include <vector>

int main(int argc, char** argv) {
  if (argc < 2) {
    std::cout << "Usage: " << argv[0] << " <pcd_file>\n";
    return -1;
  }

  const std::string pcd_file(argv[1]);
  pcl::PointCloud<pcl::PointXYZI>::Ptr point_cloud(
      new pcl::PointCloud<pcl::PointXYZI>);

  if (pcl::io::loadPCDFile<pcl::PointXYZI>(pcd_file, *point_cloud) == -1) {
    std::cout << "Couldn't read pcd file!\n";
    return -1;
  }

  constexpr int width = 2048;
  constexpr int height = 64;
  constexpr float fov_up = 3 * M_PI / 180.0;
  constexpr float fov_down = -25 * M_PI / 180.0;
  constexpr float fov = std::abs(fov_up) + std::abs(fov_down);
  const std::vector<float> image_means{12.12, 10.88, 0.23, -1.04, 0.21};
  const std::vector<float> image_stds{12.32, 11.47, 6.91, 0.86, 0.16};
  float* range_images = new float[5 * width * height]();

  for (const auto& point : point_cloud->points) {
    const auto& x = point.x;
    const auto& y = point.y;
    const auto& z = point.z;
    const auto& intensity = point.intensity;
    const float range = std::sqrt(x * x + y * y + z * z);
    const float yaw = -std::atan2(y, x);
    const float pitch = std::asin(z / range);

    float proj_x = 0.5f * (yaw / M_PI + 1.0f) * width;
    float proj_y = (1.0f - (pitch + std::abs(fov_down)) / fov) * height;
    proj_x = std::floor(proj_x);
    proj_y = std::floor(proj_y);

    const int u = std::clamp<int>(static_cast<int>(proj_x), 0, width - 1);
    const int v = std::clamp<int>(static_cast<int>(proj_y), 0, height - 1);

    range_images[0 * width * height + v * width + u] =
        (range - image_means.at(0)) / image_stds.at(0);
    range_images[1 * width * height + v * width + u] =
        (x - image_means.at(1)) / image_stds.at(1);
    range_images[2 * width * height + v * width + u] =
        (y - image_means.at(2)) / image_stds.at(2);
    range_images[3 * width * height + v * width + u] =
        (z - image_means.at(3)) / image_stds.at(3);
    range_images[4 * width * height + v * width + u] =
        (intensity - image_means.at(4)) / image_stds.at(4);
  }

  // 对range通道进行可视化
  cv::Mat range =
      cv::Mat(height, width, CV_32FC1, static_cast<void*>(range_images));
  cv::Mat normalized_range, u8_range, color_map;
  cv::normalize(range, normalized_range, 255, 0, cv::NORM_MINMAX);
  normalized_range.convertTo(u8_range, CV_8UC1);
  cv::applyColorMap(u8_range, color_map, cv::COLORMAP_JET);
  cv::imwrite("range_color_map.jpg", color_map);
  cv::imshow("Range Image", color_map);
  cv::waitKey(0);

  delete[] range_images;

  return 0;
}

range通道可视化的结果如下图所示:

在这里插入图片描述

上面的代码有几个需要说明的地方:

  • fov_upfov_downimage_meansimage_stds这几个参数来源于RangeNet++预训练模型中的arch_cfg.yaml文件。
  • std::clamp需要c++17支持,编译的时候请使用-std=c++17编译选项。
  • 实际使用中width * height的值只需要计算一次,没必要在循环里面反复计算,这里这么写只是为了方便理解。

参考资料

  • RangeDet: In Defense of Range View for LiDAR-based 3D Object Detection
  • https://towardsdatascience.com/spherical-projection-for-point-clouds-56a2fc258e6c
  • 11
    点赞
  • 57
    收藏
    觉得还不错? 一键收藏
  • 打赏
    打赏
  • 16
    评论

“相关推荐”对你有帮助么?

  • 非常没帮助
  • 没帮助
  • 一般
  • 有帮助
  • 非常有帮助
提交
评论 16
添加红包

请填写红包祝福语或标题

红包个数最小为10个

红包金额最低5元

当前余额3.43前往充值 >
需支付:10.00
成就一亿技术人!
领取后你会自动成为博主和红包主的粉丝 规则
hope_wisdom
发出的红包

打赏作者

DeepDriving

你的鼓励将是我创作的最大动力

¥1 ¥2 ¥4 ¥6 ¥10 ¥20
扫码支付:¥1
获取中
扫码支付

您的余额不足,请更换扫码支付或充值

打赏作者

实付
使用余额支付
点击重新获取
扫码支付
钱包余额 0

抵扣说明:

1.余额是钱包充值的虚拟货币,按照1:1的比例进行支付金额的抵扣。
2.余额无法直接购买下载,可以购买VIP、付费专栏及课程。

余额充值