Skip to content

Commit 081eaaa

Browse files
style(pre-commit): autofix
1 parent be994ed commit 081eaaa

File tree

6 files changed

+12
-6
lines changed

6 files changed

+12
-6
lines changed

common/tier4_autoware_utils/include/tier4_autoware_utils/ros/published_time_publisher.hpp

+2-1
Original file line numberDiff line numberDiff line change
@@ -37,7 +37,8 @@ class PublishedTimePublisher
3737
{
3838
}
3939

40-
void publish_if_subscribed(const rclcpp::PublisherBase::ConstSharedPtr & publisher, const rclcpp::Time & stamp)
40+
void publish_if_subscribed(
41+
const rclcpp::PublisherBase::ConstSharedPtr & publisher, const rclcpp::Time & stamp)
4142
{
4243
const auto & gid_key = publisher->get_gid();
4344

control/vehicle_cmd_gate/src/vehicle_cmd_gate.cpp

+2-1
Original file line numberDiff line numberDiff line change
@@ -458,7 +458,8 @@ void VehicleCmdGate::publishControlCommands(const Commands & commands)
458458
// Publish commands
459459
vehicle_cmd_emergency_pub_->publish(vehicle_cmd_emergency);
460460
control_cmd_pub_->publish(filtered_commands.control);
461-
published_time_publisher_->publish_if_subscribed(control_cmd_pub_, filtered_commands.control.stamp);
461+
published_time_publisher_->publish_if_subscribed(
462+
control_cmd_pub_, filtered_commands.control.stamp);
462463
adapi_pause_->publish();
463464
moderate_stop_interface_->publish();
464465

perception/occupancy_grid_map_outlier_filter/src/occupancy_grid_map_outlier_filter_nodelet.cpp

+2-1
Original file line numberDiff line numberDiff line change
@@ -329,7 +329,8 @@ void OccupancyGridMapOutlierFilterComponent::onOccupancyGridMapAndPointCloud2(
329329
return;
330330
}
331331
pointcloud_pub_->publish(std::move(base_link_frame_filtered_pc_ptr));
332-
published_time_publisher_->publish_if_subscribed(pointcloud_pub_, ogm_frame_filtered_pc.header.stamp);
332+
published_time_publisher_->publish_if_subscribed(
333+
pointcloud_pub_, ogm_frame_filtered_pc.header.stamp);
333334
}
334335
if (debugger_ptr_) {
335336
debugger_ptr_->publishHighConfidence(high_confidence_pc, ogm_frame_pc.header);

perception/tracking_object_merger/src/decorative_tracker_merger.cpp

+2-1
Original file line numberDiff line numberDiff line change
@@ -223,7 +223,8 @@ void DecorativeTrackerMergerNode::mainObjectsCallback(
223223
this->decorativeMerger(main_sensor_type_, main_objects);
224224
const auto & tracked_objects = getTrackedObjects(main_objects->header);
225225
merged_object_pub_->publish(tracked_objects);
226-
published_time_publisher_->publish_if_subscribed(merged_object_pub_, tracked_objects.header.stamp);
226+
published_time_publisher_->publish_if_subscribed(
227+
merged_object_pub_, tracked_objects.header.stamp);
227228
processing_time_publisher_->publish<tier4_debug_msgs::msg::Float64Stamped>(
228229
"debug/cyclic_time_ms", stop_watch_ptr_->toc("cyclic_time", true));
229230
processing_time_publisher_->publish<tier4_debug_msgs::msg::Float64Stamped>(

planning/motion_velocity_smoother/src/motion_velocity_smoother_node.cpp

+2-1
Original file line numberDiff line numberDiff line change
@@ -315,7 +315,8 @@ void MotionVelocitySmootherNode::publishTrajectory(const TrajectoryPoints & traj
315315
Trajectory publishing_trajectory = motion_utils::convertToTrajectory(trajectory);
316316
publishing_trajectory.header = base_traj_raw_ptr_->header;
317317
pub_trajectory_->publish(publishing_trajectory);
318-
published_time_publisher_->publish_if_subscribed(pub_trajectory_, publishing_trajectory.header.stamp);
318+
published_time_publisher_->publish_if_subscribed(
319+
pub_trajectory_, publishing_trajectory.header.stamp);
319320
}
320321

321322
void MotionVelocitySmootherNode::onCurrentOdometry(const Odometry::ConstSharedPtr msg)

planning/planning_validator/src/planning_validator.cpp

+2-1
Original file line numberDiff line numberDiff line change
@@ -242,7 +242,8 @@ void PlanningValidator::publishTrajectory()
242242
if (invalid_trajectory_handling_type_ == InvalidTrajectoryHandlingType::USE_PREVIOUS_RESULT) {
243243
if (previous_published_trajectory_) {
244244
pub_traj_->publish(*previous_published_trajectory_);
245-
published_time_publisher_->publish_if_subscribed(pub_traj_, previous_published_trajectory_->header.stamp);
245+
published_time_publisher_->publish_if_subscribed(
246+
pub_traj_, previous_published_trajectory_->header.stamp);
246247
RCLCPP_ERROR(get_logger(), "Invalid Trajectory detected. Use previous trajectory.");
247248
return;
248249
}

0 commit comments

Comments
 (0)