Skip to content

Commit 106072f

Browse files
committed
fix cppcheck error
Signed-off-by: a-maumau <maumaumaumaumaumaumaumaumaumau@gmail.com>
1 parent 9827374 commit 106072f

File tree

1 file changed

+2
-2
lines changed
  • perception/autoware_lidar_centerpoint/src

1 file changed

+2
-2
lines changed

perception/autoware_lidar_centerpoint/src/node.cpp

+2-2
Original file line numberDiff line numberDiff line change
@@ -116,8 +116,8 @@ LidarCenterPointNode::LidarCenterPointNode(const rclcpp::NodeOptions & node_opti
116116
max_allowed_processing_time_ms_ = declare_parameter<double>("max_allowed_processing_time_ms");
117117
max_acceptable_consecutive_delay_ms_ =
118118
declare_parameter<double>("max_acceptable_consecutive_delay_ms");
119-
const long validation_callback_interval_ms =
120-
declare_parameter<long>("validation_callback_interval_ms");
119+
const int64_t validation_callback_interval_ms =
120+
declare_parameter<int64_t>("validation_callback_interval_ms");
121121

122122
pointcloud_sub_ = this->create_subscription<sensor_msgs::msg::PointCloud2>(
123123
"~/input/pointcloud", rclcpp::SensorDataQoS{}.keep_last(1),

0 commit comments

Comments
 (0)