Skip to content

Commit

Permalink
Apply clang-format
Browse files Browse the repository at this point in the history
  • Loading branch information
Alpaca-zip committed Jan 22, 2024
1 parent 6db5100 commit 8f86b86
Showing 1 changed file with 2 additions and 2 deletions.
4 changes: 2 additions & 2 deletions include/tracker_with_cloud_node/tracker_with_cloud_node.h
Original file line number Diff line number Diff line change
Expand Up @@ -43,6 +43,6 @@ class TrackerWithCloudNode : public rclcpp::Node
public:
TrackerWithCloudNode();
void syncCallback(const sensor_msgs::msg::CameraInfo::ConstSharedPtr& camera_info_msg,
const sensor_msgs::msg::PointCloud2::ConstSharedPtr& cloud_msg,
const ultralytics_ros::msg::YoloResult::ConstSharedPtr& yolo_result_msg);
const sensor_msgs::msg::PointCloud2::ConstSharedPtr& cloud_msg,
const ultralytics_ros::msg::YoloResult::ConstSharedPtr& yolo_result_msg);
};

0 comments on commit 8f86b86

Please sign in to comment.