Skip to content

Commit 56ed055

Browse files
authored
fix(autoware_lidar_centerpoint): fix clang-diagnostic-unused-private-field (#9471)
Signed-off-by: kobayu858 <yutaro.kobayashi@tier4.jp>
1 parent 340a5af commit 56ed055

File tree

1 file changed

+0
-1
lines changed
  • perception/autoware_lidar_centerpoint/include/autoware/lidar_centerpoint

1 file changed

+0
-1
lines changed

perception/autoware_lidar_centerpoint/include/autoware/lidar_centerpoint/node.hpp

-1
Original file line numberDiff line numberDiff line change
@@ -51,7 +51,6 @@ class LidarCenterPointNode : public rclcpp::Node
5151
rclcpp::Subscription<sensor_msgs::msg::PointCloud2>::SharedPtr pointcloud_sub_;
5252
rclcpp::Publisher<autoware_perception_msgs::msg::DetectedObjects>::SharedPtr objects_pub_;
5353

54-
float score_threshold_{0.0};
5554
std::vector<std::string> class_names_;
5655
bool has_variance_{false};
5756
bool has_twist_{false};

0 commit comments

Comments
 (0)