Skip to content
This commit does not belong to any branch on this repository, and may belong to a fork outside of the repository.

Commit 76603eb

Browse files
committedJun 17, 2024··
fix: fix inline function
Signed-off-by: vividf <yihsiang.fang@tier4.jp>
1 parent 51e96be commit 76603eb

File tree

3 files changed

+6
-6
lines changed

3 files changed

+6
-6
lines changed
 

‎sensing/pointcloud_preprocessor/include/pointcloud_preprocessor/distortion_corrector/distortion_corrector.hpp

+3-3
Original file line numberDiff line numberDiff line change
@@ -95,7 +95,7 @@ class DistortionCorrector : public DistortionCorrectorBase
9595
std::deque<geometry_msgs::msg::Vector3Stamped>::iterator & it_imu);
9696
void undistortPointCloud(bool use_imu, sensor_msgs::msg::PointCloud2 & pointcloud) override;
9797
void warnIfTimestampIsTooLate(bool is_twist_time_stamp_too_late, bool is_imu_time_stamp_too_late);
98-
inline void undistortPoint(
98+
void undistortPoint(
9999
sensor_msgs::PointCloud2Iterator<float> & it_x, sensor_msgs::PointCloud2Iterator<float> & it_y,
100100
sensor_msgs::PointCloud2Iterator<float> & it_z,
101101
std::deque<geometry_msgs::msg::TwistStamped>::iterator & it_twist,
@@ -126,7 +126,7 @@ class DistortionCorrector2D : public DistortionCorrector<DistortionCorrector2D>
126126
public:
127127
explicit DistortionCorrector2D(rclcpp::Node * node) : DistortionCorrector(node) {}
128128
void initialize() override;
129-
inline void undistortPointImplementation(
129+
void undistortPointImplementation(
130130
sensor_msgs::PointCloud2Iterator<float> & it_x, sensor_msgs::PointCloud2Iterator<float> & it_y,
131131
sensor_msgs::PointCloud2Iterator<float> & it_z,
132132
std::deque<geometry_msgs::msg::TwistStamped>::iterator & it_twist,
@@ -153,7 +153,7 @@ class DistortionCorrector3D : public DistortionCorrector<DistortionCorrector3D>
153153
public:
154154
explicit DistortionCorrector3D(rclcpp::Node * node) : DistortionCorrector(node) {}
155155
void initialize() override;
156-
inline void undistortPointImplementation(
156+
void undistortPointImplementation(
157157
sensor_msgs::PointCloud2Iterator<float> & it_x, sensor_msgs::PointCloud2Iterator<float> & it_y,
158158
sensor_msgs::PointCloud2Iterator<float> & it_z,
159159
std::deque<geometry_msgs::msg::TwistStamped>::iterator & it_twist,

‎sensing/pointcloud_preprocessor/launch/distortion_corrector_node.launch.xml

+1-1
Original file line numberDiff line numberDiff line change
@@ -2,7 +2,7 @@
22
<arg name="input/pointcloud" default="/sensing/lidar/top/mirror_cropped/pointcloud_ex"/>
33
<arg name="input/twist" default="/sensing/vehicle_velocity_converter/twist_with_covariance"/>
44
<arg name="input/imu" default="/sensing/imu/imu_data"/>
5-
<arg name="output/pointcloud" default="/sensing/lidar/top/pointcloud_before_sync"/>
5+
<arg name="output/pointcloud" default="/sensing/lidar/top/rectified/pointcloud_ex"/>
66

77
<!-- Parameter -->
88
<arg name="param_file" default="$(find-pkg-share pointcloud_preprocessor)/config/distortion_corrector_node.param.yaml"/>

‎sensing/pointcloud_preprocessor/src/distortion_corrector/distortion_corrector.cpp

+2-2
Original file line numberDiff line numberDiff line change
@@ -324,7 +324,7 @@ void DistortionCorrector3D::setPointCloudTransform(
324324
}
325325
}
326326

327-
void DistortionCorrector2D::undistortPointImplementation(
327+
inline void DistortionCorrector2D::undistortPointImplementation(
328328
sensor_msgs::PointCloud2Iterator<float> & it_x, sensor_msgs::PointCloud2Iterator<float> & it_y,
329329
sensor_msgs::PointCloud2Iterator<float> & it_z,
330330
std::deque<geometry_msgs::msg::TwistStamped>::iterator & it_twist,
@@ -369,7 +369,7 @@ void DistortionCorrector2D::undistortPointImplementation(
369369
*it_z = static_cast<float>(undistorted_point_tf_.getZ());
370370
}
371371

372-
void DistortionCorrector3D::undistortPointImplementation(
372+
inline void DistortionCorrector3D::undistortPointImplementation(
373373
sensor_msgs::PointCloud2Iterator<float> & it_x, sensor_msgs::PointCloud2Iterator<float> & it_y,
374374
sensor_msgs::PointCloud2Iterator<float> & it_z,
375375
std::deque<geometry_msgs::msg::TwistStamped>::iterator & it_twist,

0 commit comments

Comments
 (0)
Please sign in to comment.