Skip to content

Commit

Permalink
linter
Browse files Browse the repository at this point in the history
  • Loading branch information
meshvaD committed Jun 9, 2024
1 parent c4a59c3 commit 417ae6c
Show file tree
Hide file tree
Showing 6 changed files with 571 additions and 537 deletions.
35 changes: 17 additions & 18 deletions src/perception/tracking/dets_2d_3d/include/cluster.hpp
Original file line number Diff line number Diff line change
@@ -1,34 +1,33 @@
#pragma once

#include <pcl/point_types.h>
#include <pcl/point_cloud.h>
#include <pcl/point_types.h>

#include <vision_msgs/msg/detection3_d_array.hpp>

#include <vector>

class Cluster
{
class Cluster {

Check failure on line 10 in src/perception/tracking/dets_2d_3d/include/cluster.hpp

View workflow job for this annotation

GitHub Actions / clang_format

src/perception/tracking/dets_2d_3d/include/cluster.hpp#L10

code should be clang-formatted [-Wclang-format-violations]
public:
// makes a cloud from all points `in_cloud_ptr` that are indexed by `in_cluster_indices`
Cluster(
const pcl::PointCloud<pcl::PointXYZ>::Ptr& in_cloud_ptr,
const std::vector<int>& in_cluster_indices);
// makes a cloud from all points `in_cloud_ptr` that are indexed by
// `in_cluster_indices`
Cluster(const pcl::PointCloud<pcl::PointXYZ>::Ptr &in_cloud_ptr,
const std::vector<int> &in_cluster_indices);

pcl::PointXYZ getCentroid() { return centroid_; }
pcl::PointCloud<pcl::PointXYZRGB>::Ptr getCloud() { return cloud_; }
vision_msgs::msg::BoundingBox3D getBoundingBox();
pcl::PointXYZ getCentroid() { return centroid_; }
pcl::PointCloud<pcl::PointXYZRGB>::Ptr getCloud() { return cloud_; }
vision_msgs::msg::BoundingBox3D getBoundingBox();

bool isValid();
int size() { return cloud_->size(); }
bool isValid();
int size() { return cloud_->size(); }

Check failure on line 22 in src/perception/tracking/dets_2d_3d/include/cluster.hpp

View workflow job for this annotation

GitHub Actions / clang_format

src/perception/tracking/dets_2d_3d/include/cluster.hpp#L22

code should be clang-formatted [-Wclang-format-violations]

private:
pcl::PointCloud<pcl::PointXYZRGB>::Ptr cloud_;
pcl::PointXYZ centroid_;
pcl::PointCloud<pcl::PointXYZRGB>::Ptr cloud_;
pcl::PointXYZ centroid_;

pcl::PointXYZ max_point_;
pcl::PointXYZ min_point_;
pcl::PointXYZ max_point_;
pcl::PointXYZ min_point_;

static int color_index;
static std::vector<std::vector<int>> colors;
static int color_index;
static std::vector<std::vector<int>> colors;
};
122 changes: 62 additions & 60 deletions src/perception/tracking/dets_2d_3d/include/dets_2d_3d_node.hpp
Original file line number Diff line number Diff line change
Expand Up @@ -10,11 +10,11 @@
#include <visualization_msgs/msg/marker_array.hpp>

#include <tf2_ros/buffer.h>
#include <tf2_ros/transform_listener.h>
#include <tf2_ros/static_transform_broadcaster.h>
#include <tf2_ros/transform_listener.h>

#include <pcl/point_types.h>
#include <pcl/point_cloud.h>
#include <pcl/point_types.h>

#include "cluster.hpp"
#include "projection_utils.hpp"
Expand All @@ -23,65 +23,67 @@

struct ClusteringParams;

class TrackingNode : public rclcpp::Node
{
class TrackingNode : public rclcpp::Node {

Check failure on line 26 in src/perception/tracking/dets_2d_3d/include/dets_2d_3d_node.hpp

View workflow job for this annotation

GitHub Actions / clang_format

src/perception/tracking/dets_2d_3d/include/dets_2d_3d_node.hpp#L26

code should be clang-formatted [-Wclang-format-violations]
public:
TrackingNode();
TrackingNode();

Check failure on line 28 in src/perception/tracking/dets_2d_3d/include/dets_2d_3d_node.hpp

View workflow job for this annotation

GitHub Actions / clang_format

src/perception/tracking/dets_2d_3d/include/dets_2d_3d_node.hpp#L28

code should be clang-formatted [-Wclang-format-violations]

private:
std::map<std::string, ClusteringParams> clusteringParams;

// lidar and camera frame names
std::string lidarFrame_;
std::string cameraFrame_;

// synchronization utils
std::mutex lidarCloud_mutex_;

// camera information cached
bool transformInited_;
geometry_msgs::msg::TransformStamped transform_;
sensor_msgs::msg::CameraInfo::SharedPtr camInfo_;
pcl::PointCloud<pcl::PointXYZ>::Ptr lidarCloud_;

// subscribers to camera intrinsics, lidar pts, camera feed, 2d detection boxes
rclcpp::Subscription<sensor_msgs::msg::CameraInfo>::SharedPtr camInfo_subscriber_;
rclcpp::Subscription<sensor_msgs::msg::PointCloud2>::SharedPtr lidar_subscriber_;
rclcpp::Subscription<vision_msgs::msg::Detection2DArray>::SharedPtr det_subscriber_;

// publish the 3d detections
rclcpp::Publisher<vision_msgs::msg::Detection3DArray>::SharedPtr det3d_publisher_;
rclcpp::Publisher<visualization_msgs::msg::MarkerArray>::SharedPtr marker_publisher_;
rclcpp::Publisher<sensor_msgs::msg::PointCloud2>::SharedPtr pc_publisher_;
rclcpp::Publisher<sensor_msgs::msg::PointCloud2>::SharedPtr pc_publisher2_;

std::unique_ptr<tf2_ros::Buffer> tf_buffer_;
std::shared_ptr<tf2_ros::TransformListener> tf_listener_;

void readCameraInfo(const sensor_msgs::msg::CameraInfo::SharedPtr msg);
void receiveLidar(const sensor_msgs::msg::PointCloud2::SharedPtr msg);
void receiveDetections(const vision_msgs::msg::Detection2DArray::SharedPtr msg);

int highestIOUScoredBBox(
const std::vector<vision_msgs::msg::BoundingBox3D> bboxes,
const vision_msgs::msg::BoundingBox2D& detBBox,
const std::vector<std::shared_ptr<Cluster>>& clusters);
double overlapBoundingBox(
const vision_msgs::msg::BoundingBox2D& bboxA,
const vision_msgs::msg::BoundingBox2D& bboxB);
double iouScore(
const vision_msgs::msg::BoundingBox2D& bboxA,
const vision_msgs::msg::BoundingBox2D& bboxB);

std::map<std::string, ClusteringParams> initializeClusteringParams(
const std::map<std::string, rclcpp::Parameter>& clustering_params_map);

template <typename T>
T getDefaultOrValue(std::map<std::string, T> m, std::string key)
{
if (m.find(key) == m.end())
return m[key];
return m["default"];
}

std::map<std::string, ClusteringParams> clusteringParams;

// lidar and camera frame names
std::string lidarFrame_;
std::string cameraFrame_;

// synchronization utils
std::mutex lidarCloud_mutex_;

// camera information cached
bool transformInited_;
geometry_msgs::msg::TransformStamped transform_;
sensor_msgs::msg::CameraInfo::SharedPtr camInfo_;
pcl::PointCloud<pcl::PointXYZ>::Ptr lidarCloud_;

// subscribers to camera intrinsics, lidar pts, camera feed, 2d detection
// boxes
rclcpp::Subscription<sensor_msgs::msg::CameraInfo>::SharedPtr

Check failure on line 48 in src/perception/tracking/dets_2d_3d/include/dets_2d_3d_node.hpp

View workflow job for this annotation

GitHub Actions / clang_format

src/perception/tracking/dets_2d_3d/include/dets_2d_3d_node.hpp#L48

code should be clang-formatted [-Wclang-format-violations]
camInfo_subscriber_;
rclcpp::Subscription<sensor_msgs::msg::PointCloud2>::SharedPtr

Check failure on line 50 in src/perception/tracking/dets_2d_3d/include/dets_2d_3d_node.hpp

View workflow job for this annotation

GitHub Actions / clang_format

src/perception/tracking/dets_2d_3d/include/dets_2d_3d_node.hpp#L50

code should be clang-formatted [-Wclang-format-violations]
lidar_subscriber_;
rclcpp::Subscription<vision_msgs::msg::Detection2DArray>::SharedPtr

Check failure on line 52 in src/perception/tracking/dets_2d_3d/include/dets_2d_3d_node.hpp

View workflow job for this annotation

GitHub Actions / clang_format

src/perception/tracking/dets_2d_3d/include/dets_2d_3d_node.hpp#L52

code should be clang-formatted [-Wclang-format-violations]
det_subscriber_;

// publish the 3d detections
rclcpp::Publisher<vision_msgs::msg::Detection3DArray>::SharedPtr

Check failure on line 56 in src/perception/tracking/dets_2d_3d/include/dets_2d_3d_node.hpp

View workflow job for this annotation

GitHub Actions / clang_format

src/perception/tracking/dets_2d_3d/include/dets_2d_3d_node.hpp#L56

code should be clang-formatted [-Wclang-format-violations]
det3d_publisher_;
rclcpp::Publisher<visualization_msgs::msg::MarkerArray>::SharedPtr

Check failure on line 58 in src/perception/tracking/dets_2d_3d/include/dets_2d_3d_node.hpp

View workflow job for this annotation

GitHub Actions / clang_format

src/perception/tracking/dets_2d_3d/include/dets_2d_3d_node.hpp#L58

code should be clang-formatted [-Wclang-format-violations]
marker_publisher_;
rclcpp::Publisher<sensor_msgs::msg::PointCloud2>::SharedPtr pc_publisher_;
rclcpp::Publisher<sensor_msgs::msg::PointCloud2>::SharedPtr pc_publisher2_;

std::unique_ptr<tf2_ros::Buffer> tf_buffer_;
std::shared_ptr<tf2_ros::TransformListener> tf_listener_;

void readCameraInfo(const sensor_msgs::msg::CameraInfo::SharedPtr msg);
void receiveLidar(const sensor_msgs::msg::PointCloud2::SharedPtr msg);
void

Check failure on line 68 in src/perception/tracking/dets_2d_3d/include/dets_2d_3d_node.hpp

View workflow job for this annotation

GitHub Actions / clang_format

src/perception/tracking/dets_2d_3d/include/dets_2d_3d_node.hpp#L68

code should be clang-formatted [-Wclang-format-violations]
receiveDetections(const vision_msgs::msg::Detection2DArray::SharedPtr msg);

int highestIOUScoredBBox(

Check failure on line 71 in src/perception/tracking/dets_2d_3d/include/dets_2d_3d_node.hpp

View workflow job for this annotation

GitHub Actions / clang_format

src/perception/tracking/dets_2d_3d/include/dets_2d_3d_node.hpp#L71

code should be clang-formatted [-Wclang-format-violations]
const std::vector<vision_msgs::msg::BoundingBox3D> bboxes,

Check failure on line 72 in src/perception/tracking/dets_2d_3d/include/dets_2d_3d_node.hpp

View workflow job for this annotation

GitHub Actions / clang_format

src/perception/tracking/dets_2d_3d/include/dets_2d_3d_node.hpp#L72

code should be clang-formatted [-Wclang-format-violations]
const vision_msgs::msg::BoundingBox2D &detBBox,

Check failure on line 73 in src/perception/tracking/dets_2d_3d/include/dets_2d_3d_node.hpp

View workflow job for this annotation

GitHub Actions / clang_format

src/perception/tracking/dets_2d_3d/include/dets_2d_3d_node.hpp#L73

code should be clang-formatted [-Wclang-format-violations]
const std::vector<std::shared_ptr<Cluster>> &clusters);
double overlapBoundingBox(const vision_msgs::msg::BoundingBox2D &bboxA,
const vision_msgs::msg::BoundingBox2D &bboxB);
double iouScore(const vision_msgs::msg::BoundingBox2D &bboxA,
const vision_msgs::msg::BoundingBox2D &bboxB);

std::map<std::string, ClusteringParams> initializeClusteringParams(
const std::map<std::string, rclcpp::Parameter> &clustering_params_map);

template <typename T>
T getDefaultOrValue(std::map<std::string, T> m, std::string key) {
if (m.find(key) == m.end())

Check failure on line 85 in src/perception/tracking/dets_2d_3d/include/dets_2d_3d_node.hpp

View workflow job for this annotation

GitHub Actions / clang_format

src/perception/tracking/dets_2d_3d/include/dets_2d_3d_node.hpp#L85

code should be clang-formatted [-Wclang-format-violations]
return m[key];
return m["default"];
}
};
99 changes: 51 additions & 48 deletions src/perception/tracking/dets_2d_3d/include/projection_utils.hpp
Original file line number Diff line number Diff line change
Expand Up @@ -2,72 +2,75 @@

#include "cluster.hpp"

#include <pcl/point_types.h>
#include <geometry_msgs/msg/point.hpp>

Check failure on line 5 in src/perception/tracking/dets_2d_3d/include/projection_utils.hpp

View workflow job for this annotation

GitHub Actions / clang_format

src/perception/tracking/dets_2d_3d/include/projection_utils.hpp#L5

code should be clang-formatted [-Wclang-format-violations]
#include <geometry_msgs/msg/transform_stamped.hpp>
#include <pcl/point_cloud.h>
#include <pcl/point_types.h>
#include <vision_msgs/msg/bounding_box2_d.hpp>
#include <vision_msgs/msg/bounding_box3_d.hpp>
#include <geometry_msgs/msg/transform_stamped.hpp>
#include <geometry_msgs/msg/point.hpp>

#include <vector>
#include <optional>
#include <vector>

struct ClusteringParams
{
// segment by distance
std::vector<double> clustering_distances;
// Map of the nearest neighbor distance threshold for each segment, for each detection
std::vector<double> clustering_thresholds;
struct ClusteringParams {
// segment by distance
std::vector<double> clustering_distances;
// Map of the nearest neighbor distance threshold for each segment, for each
// detection
std::vector<double> clustering_thresholds;

double cluster_size_min;
double cluster_size_max;
double cluster_merge_threshold;
double cluster_size_min;
double cluster_size_max;
double cluster_merge_threshold;
};

// main helper functions used by the node -- should all be static
class ProjectionUtils
{
class ProjectionUtils {

Check failure on line 28 in src/perception/tracking/dets_2d_3d/include/projection_utils.hpp

View workflow job for this annotation

GitHub Actions / clang_format

src/perception/tracking/dets_2d_3d/include/projection_utils.hpp#L28

code should be clang-formatted [-Wclang-format-violations]
public:
static void pointsInBbox(
const pcl::PointCloud<pcl::PointXYZ>::Ptr& inlierCloud,
const pcl::PointCloud<pcl::PointXYZ>::Ptr& lidarCloud,
const std::vector<geometry_msgs::msg::Point>& projs2d,
const vision_msgs::msg::BoundingBox2D& bbox);
static void

Check failure on line 30 in src/perception/tracking/dets_2d_3d/include/projection_utils.hpp

View workflow job for this annotation

GitHub Actions / clang_format

src/perception/tracking/dets_2d_3d/include/projection_utils.hpp#L30

code should be clang-formatted [-Wclang-format-violations]
pointsInBbox(const pcl::PointCloud<pcl::PointXYZ>::Ptr &inlierCloud,

Check failure on line 31 in src/perception/tracking/dets_2d_3d/include/projection_utils.hpp

View workflow job for this annotation

GitHub Actions / clang_format

src/perception/tracking/dets_2d_3d/include/projection_utils.hpp#L31

code should be clang-formatted [-Wclang-format-violations]
const pcl::PointCloud<pcl::PointXYZ>::Ptr &lidarCloud,

Check failure on line 32 in src/perception/tracking/dets_2d_3d/include/projection_utils.hpp

View workflow job for this annotation

GitHub Actions / clang_format

src/perception/tracking/dets_2d_3d/include/projection_utils.hpp#L32

code should be clang-formatted [-Wclang-format-violations]
const std::vector<geometry_msgs::msg::Point> &projs2d,

Check failure on line 33 in src/perception/tracking/dets_2d_3d/include/projection_utils.hpp

View workflow job for this annotation

GitHub Actions / clang_format

src/perception/tracking/dets_2d_3d/include/projection_utils.hpp#L33

code should be clang-formatted [-Wclang-format-violations]
const vision_msgs::msg::BoundingBox2D &bbox);

// P : projection matrix, pt : 3D lidar pt, transform: transform from lidar to camera frame
static std::optional<geometry_msgs::msg::Point> projectLidarToCamera(
const geometry_msgs::msg::TransformStamped& transform,
const std::array<double, 12>& P,
const pcl::PointXYZ& pt);
// P : projection matrix, pt : 3D lidar pt, transform: transform from lidar to
// camera frame
static std::optional<geometry_msgs::msg::Point>

Check failure on line 38 in src/perception/tracking/dets_2d_3d/include/projection_utils.hpp

View workflow job for this annotation

GitHub Actions / clang_format

src/perception/tracking/dets_2d_3d/include/projection_utils.hpp#L38

code should be clang-formatted [-Wclang-format-violations]
projectLidarToCamera(const geometry_msgs::msg::TransformStamped &transform,

Check failure on line 39 in src/perception/tracking/dets_2d_3d/include/projection_utils.hpp

View workflow job for this annotation

GitHub Actions / clang_format

src/perception/tracking/dets_2d_3d/include/projection_utils.hpp#L39

code should be clang-formatted [-Wclang-format-violations]

Check failure on line 39 in src/perception/tracking/dets_2d_3d/include/projection_utils.hpp

View workflow job for this annotation

GitHub Actions / clang_format

src/perception/tracking/dets_2d_3d/include/projection_utils.hpp#L39

code should be clang-formatted [-Wclang-format-violations]
const std::array<double, 12> &P,

Check failure on line 40 in src/perception/tracking/dets_2d_3d/include/projection_utils.hpp

View workflow job for this annotation

GitHub Actions / clang_format

src/perception/tracking/dets_2d_3d/include/projection_utils.hpp#L40

code should be clang-formatted [-Wclang-format-violations]
const pcl::PointXYZ &pt);

static bool isPointInBbox(
const geometry_msgs::msg::Point& pt,
const vision_msgs::msg::BoundingBox2D& bbox);
static bool isPointInBbox(const geometry_msgs::msg::Point &pt,
const vision_msgs::msg::BoundingBox2D &bbox);

static void removeFloor(
const pcl::PointCloud<pcl::PointXYZ>::Ptr& lidarCloud,
const pcl::PointCloud<pcl::PointXYZ>::Ptr& cloud_filtered);
static void

Check failure on line 46 in src/perception/tracking/dets_2d_3d/include/projection_utils.hpp

View workflow job for this annotation

GitHub Actions / clang_format

src/perception/tracking/dets_2d_3d/include/projection_utils.hpp#L46

code should be clang-formatted [-Wclang-format-violations]
removeFloor(const pcl::PointCloud<pcl::PointXYZ>::Ptr &lidarCloud,

Check failure on line 47 in src/perception/tracking/dets_2d_3d/include/projection_utils.hpp

View workflow job for this annotation

GitHub Actions / clang_format

src/perception/tracking/dets_2d_3d/include/projection_utils.hpp#L47

code should be clang-formatted [-Wclang-format-violations]
const pcl::PointCloud<pcl::PointXYZ>::Ptr &cloud_filtered);

static std::pair<std::vector<std::shared_ptr<Cluster>>, std::vector<vision_msgs::msg::BoundingBox3D>> getClusteredBBoxes(
const pcl::PointCloud<pcl::PointXYZ>::Ptr& lidarCloud, const ClusteringParams& clusteringParams);
static std::pair<std::vector<std::shared_ptr<Cluster>>,
std::vector<vision_msgs::msg::BoundingBox3D>>
getClusteredBBoxes(const pcl::PointCloud<pcl::PointXYZ>::Ptr &lidarCloud,
const ClusteringParams &clusteringParams);

Check failure on line 53 in src/perception/tracking/dets_2d_3d/include/projection_utils.hpp

View workflow job for this annotation

GitHub Actions / clang_format

src/perception/tracking/dets_2d_3d/include/projection_utils.hpp#L53

code should be clang-formatted [-Wclang-format-violations]

private:
static std::vector<std::shared_ptr<Cluster>>

Check failure on line 56 in src/perception/tracking/dets_2d_3d/include/projection_utils.hpp

View workflow job for this annotation

GitHub Actions / clang_format

src/perception/tracking/dets_2d_3d/include/projection_utils.hpp#L56

code should be clang-formatted [-Wclang-format-violations]
clusterAndColor(const pcl::PointCloud<pcl::PointXYZ>::Ptr &in_cloud_ptr,

Check failure on line 57 in src/perception/tracking/dets_2d_3d/include/projection_utils.hpp

View workflow job for this annotation

GitHub Actions / clang_format

src/perception/tracking/dets_2d_3d/include/projection_utils.hpp#L57

code should be clang-formatted [-Wclang-format-violations]

Check failure on line 57 in src/perception/tracking/dets_2d_3d/include/projection_utils.hpp

View workflow job for this annotation

GitHub Actions / clang_format

src/perception/tracking/dets_2d_3d/include/projection_utils.hpp#L57

code should be clang-formatted [-Wclang-format-violations]
double in_max_cluster_distance, double cluster_size_min,

Check failure on line 58 in src/perception/tracking/dets_2d_3d/include/projection_utils.hpp

View workflow job for this annotation

GitHub Actions / clang_format

src/perception/tracking/dets_2d_3d/include/projection_utils.hpp#L58

code should be clang-formatted [-Wclang-format-violations]

Check failure on line 58 in src/perception/tracking/dets_2d_3d/include/projection_utils.hpp

View workflow job for this annotation

GitHub Actions / clang_format

src/perception/tracking/dets_2d_3d/include/projection_utils.hpp#L58

code should be clang-formatted [-Wclang-format-violations]
double cluster_size_max);

static std::vector<std::shared_ptr<Cluster>> clusterAndColor(
const pcl::PointCloud<pcl::PointXYZ>::Ptr& in_cloud_ptr,
double in_max_cluster_distance, double cluster_size_min, double cluster_size_max);

static void checkClusterMerge(
size_t in_cluster_id, const std::vector<std::shared_ptr<Cluster>> &in_clusters,
std::vector<bool> &in_out_visited_clusters,
std::vector<size_t> &out_merge_indices, double in_merge_threshold);
static void

Check failure on line 61 in src/perception/tracking/dets_2d_3d/include/projection_utils.hpp

View workflow job for this annotation

GitHub Actions / clang_format

src/perception/tracking/dets_2d_3d/include/projection_utils.hpp#L61

code should be clang-formatted [-Wclang-format-violations]
checkClusterMerge(size_t in_cluster_id,

Check failure on line 62 in src/perception/tracking/dets_2d_3d/include/projection_utils.hpp

View workflow job for this annotation

GitHub Actions / clang_format

src/perception/tracking/dets_2d_3d/include/projection_utils.hpp#L62

code should be clang-formatted [-Wclang-format-violations]
const std::vector<std::shared_ptr<Cluster>> &in_clusters,

Check failure on line 63 in src/perception/tracking/dets_2d_3d/include/projection_utils.hpp

View workflow job for this annotation

GitHub Actions / clang_format

src/perception/tracking/dets_2d_3d/include/projection_utils.hpp#L63

code should be clang-formatted [-Wclang-format-violations]
std::vector<bool> &in_out_visited_clusters,

Check failure on line 64 in src/perception/tracking/dets_2d_3d/include/projection_utils.hpp

View workflow job for this annotation

GitHub Actions / clang_format

src/perception/tracking/dets_2d_3d/include/projection_utils.hpp#L64

code should be clang-formatted [-Wclang-format-violations]
std::vector<size_t> &out_merge_indices,

Check failure on line 65 in src/perception/tracking/dets_2d_3d/include/projection_utils.hpp

View workflow job for this annotation

GitHub Actions / clang_format

src/perception/tracking/dets_2d_3d/include/projection_utils.hpp#L65

code should be clang-formatted [-Wclang-format-violations]
double in_merge_threshold);

static std::shared_ptr<Cluster> mergeClusters(
const std::vector<std::shared_ptr<Cluster>>& in_clusters,
const std::vector<size_t>& in_merge_indices,
std::vector<bool>& in_out_merged_clusters);
static std::shared_ptr<Cluster>

Check failure on line 68 in src/perception/tracking/dets_2d_3d/include/projection_utils.hpp

View workflow job for this annotation

GitHub Actions / clang_format

src/perception/tracking/dets_2d_3d/include/projection_utils.hpp#L68

code should be clang-formatted [-Wclang-format-violations]
mergeClusters(const std::vector<std::shared_ptr<Cluster>> &in_clusters,

Check failure on line 69 in src/perception/tracking/dets_2d_3d/include/projection_utils.hpp

View workflow job for this annotation

GitHub Actions / clang_format

src/perception/tracking/dets_2d_3d/include/projection_utils.hpp#L69

code should be clang-formatted [-Wclang-format-violations]

Check failure on line 69 in src/perception/tracking/dets_2d_3d/include/projection_utils.hpp

View workflow job for this annotation

GitHub Actions / clang_format

src/perception/tracking/dets_2d_3d/include/projection_utils.hpp#L69

code should be clang-formatted [-Wclang-format-violations]
const std::vector<size_t> &in_merge_indices,

Check failure on line 70 in src/perception/tracking/dets_2d_3d/include/projection_utils.hpp

View workflow job for this annotation

GitHub Actions / clang_format

src/perception/tracking/dets_2d_3d/include/projection_utils.hpp#L70

code should be clang-formatted [-Wclang-format-violations]
std::vector<bool> &in_out_merged_clusters);

static std::vector<std::shared_ptr<Cluster>> checkAllForMerge(
const std::vector<std::shared_ptr<Cluster>>& in_clusters,
float in_merge_threshold);
static std::vector<std::shared_ptr<Cluster>>

Check failure on line 73 in src/perception/tracking/dets_2d_3d/include/projection_utils.hpp

View workflow job for this annotation

GitHub Actions / clang_format

src/perception/tracking/dets_2d_3d/include/projection_utils.hpp#L73

code should be clang-formatted [-Wclang-format-violations]
checkAllForMerge(const std::vector<std::shared_ptr<Cluster>> &in_clusters,

Check failure on line 74 in src/perception/tracking/dets_2d_3d/include/projection_utils.hpp

View workflow job for this annotation

GitHub Actions / clang_format

src/perception/tracking/dets_2d_3d/include/projection_utils.hpp#L74

code should be clang-formatted [-Wclang-format-violations]

Check failure on line 74 in src/perception/tracking/dets_2d_3d/include/projection_utils.hpp

View workflow job for this annotation

GitHub Actions / clang_format

src/perception/tracking/dets_2d_3d/include/projection_utils.hpp#L74

code should be clang-formatted [-Wclang-format-violations]
float in_merge_threshold);
};
Loading

0 comments on commit 417ae6c

Please sign in to comment.