Skip to content

Commit 9ef9b20

Browse files
style(pre-commit): autofix
1 parent a0a3f59 commit 9ef9b20

File tree

2 files changed

+4
-4
lines changed

2 files changed

+4
-4
lines changed

Diff for: sensing/pointcloud_preprocessor/src/crop_box_filter/crop_box_filter_nodelet.cpp

+2-2
Original file line numberDiff line numberDiff line change
@@ -90,8 +90,8 @@ CropBoxFilterComponent::CropBoxFilterComponent(const rclcpp::NodeOptions & optio
9090
rclcpp::PublisherOptions pub_options;
9191
pub_options.qos_overriding_options = rclcpp::QosOverridingOptions::with_default_policies();
9292

93-
crop_box_polygon_pub_ =
94-
this->create_publisher<geometry_msgs::msg::PolygonStamped>("~/crop_box_polygon", 10, pub_options);
93+
crop_box_polygon_pub_ = this->create_publisher<geometry_msgs::msg::PolygonStamped>(
94+
"~/crop_box_polygon", 10, pub_options);
9595
}
9696

9797
// set parameter service callback

Diff for: sensing/pointcloud_preprocessor/src/distortion_corrector/distortion_corrector.cpp

+2-2
Original file line numberDiff line numberDiff line change
@@ -45,8 +45,8 @@ DistortionCorrectorComponent::DistortionCorrectorComponent(const rclcpp::NodeOpt
4545
pub_options.qos_overriding_options = rclcpp::QosOverridingOptions::with_default_policies();
4646

4747
// Publisher
48-
undistorted_points_pub_ =
49-
this->create_publisher<PointCloud2>("~/output/pointcloud", rclcpp::SensorDataQoS(), pub_options);
48+
undistorted_points_pub_ = this->create_publisher<PointCloud2>(
49+
"~/output/pointcloud", rclcpp::SensorDataQoS(), pub_options);
5050
}
5151
// Subscriber
5252
twist_sub_ = this->create_subscription<geometry_msgs::msg::TwistWithCovarianceStamped>(

0 commit comments

Comments
 (0)