Skip to content

Commit

Permalink
Revert "chore: refactor"
Browse files Browse the repository at this point in the history
This reverts commit e3cbf6c.
  • Loading branch information
badai-nguyen committed Oct 30, 2023
1 parent c3317b6 commit e3389ee
Show file tree
Hide file tree
Showing 2 changed files with 174 additions and 135 deletions.
Original file line number Diff line number Diff line change
Expand Up @@ -35,9 +35,6 @@
#include <vector>
namespace obstacle_pointcloud_based_validator
{
using Shape = autoware_auto_perception_msgs::msg::Shape;
using Polygon2d = tier4_autoware_utils::Polygon2d;

struct PointsNumThresholdParam
{
std::vector<int64_t> min_points_num;
Expand Down Expand Up @@ -70,11 +67,9 @@ class ObstaclePointCloudBasedValidator : public rclcpp::Node
void onObjectsAndObstaclePointCloud(
const autoware_auto_perception_msgs::msg::DetectedObjects::ConstSharedPtr & input_objects,
const sensor_msgs::msg::PointCloud2::ConstSharedPtr & input_obstacle_pointcloud);
void cropPointsInsidePolygon(
const pcl::PointCloud<pcl::PointXYZ>::Ptr & input_points, const Polygon2d & poly2d,
pcl::PointCloud<pcl::PointXYZ>::Ptr & output_points);
size_t getValidationThreshold(
const geometry_msgs::msg::Point & transformed_object_position, const uint8_t object_label_id);
void on3dObjectsAndObstaclePointCloud(
const autoware_auto_perception_msgs::msg::DetectedObjects::ConstSharedPtr & input_objects,
const sensor_msgs::msg::PointCloud2::ConstSharedPtr & input_obstacle_pointcloud);
std::optional<size_t> getPointCloudNumWithinPolygon(
const autoware_auto_perception_msgs::msg::DetectedObject & object,
const pcl::PointCloud<pcl::PointXY>::Ptr pointcloud);
Expand Down
Loading

0 comments on commit e3389ee

Please sign in to comment.