We read every piece of feedback, and take your input very seriously.
To see all available qualifiers, see our documentation.
1 parent 340a5af commit 56ed055Copy full SHA for 56ed055
perception/autoware_lidar_centerpoint/include/autoware/lidar_centerpoint/node.hpp
@@ -51,7 +51,6 @@ class LidarCenterPointNode : public rclcpp::Node
51
rclcpp::Subscription<sensor_msgs::msg::PointCloud2>::SharedPtr pointcloud_sub_;
52
rclcpp::Publisher<autoware_perception_msgs::msg::DetectedObjects>::SharedPtr objects_pub_;
53
54
- float score_threshold_{0.0};
55
std::vector<std::string> class_names_;
56
bool has_variance_{false};
57
bool has_twist_{false};
0 commit comments