Skip to content

Commit

Permalink
ci(pre-commit): autofix
Browse files Browse the repository at this point in the history
  • Loading branch information
pre-commit-ci[bot] authored and brkay54 committed Feb 1, 2023
1 parent 5d94ee6 commit 6c5cb9b
Show file tree
Hide file tree
Showing 4 changed files with 4 additions and 5 deletions.
Original file line number Diff line number Diff line change
Expand Up @@ -17,8 +17,8 @@

#include <rclcpp/qos.hpp>

#include <tier4_control_msgs/msg/pause_state_stamped.hpp>
#include <tier4_control_msgs/msg/is_start_requested.hpp>
#include <tier4_control_msgs/msg/pause_state_stamped.hpp>
#include <tier4_control_msgs/srv/set_pause.hpp>

namespace control_interface
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -100,7 +100,8 @@ class PredictedPathCheckerNode : public rclcpp::Node
sub_predicted_trajectory_;
rclcpp::Subscription<nav_msgs::msg::Odometry>::SharedPtr sub_odom_;
rclcpp::Subscription<geometry_msgs::msg::AccelWithCovarianceStamped>::SharedPtr sub_accel_;
component_interface_utils::Subscription<control_interface::PauseState>::SharedPtr sub_pause_state_;
component_interface_utils::Subscription<control_interface::PauseState>::SharedPtr
sub_pause_state_;
component_interface_utils::Subscription<control_interface::IsStartRequested>::SharedPtr
sub_is_start_requested_;

Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -237,8 +237,7 @@ void PredictedPathCheckerNode::onTimer()

// send pause request
if (current_state_ == State::PAUSE) {
if (
current_pause_state_->state == tier4_control_msgs::msg::PauseState::DRIVE) {
if (current_pause_state_->state == tier4_control_msgs::msg::PauseState::DRIVE) {
sendRequest(true);
}
} else if (current_state_ == State::DRIVE) {
Expand Down
1 change: 0 additions & 1 deletion control/vehicle_cmd_gate/src/pause_interface.hpp
Original file line number Diff line number Diff line change
Expand Up @@ -17,7 +17,6 @@

#include <component_interface_specs/control.hpp>
#include <component_interface_utils/rclcpp.hpp>

#include <rclcpp/rclcpp.hpp>

#include <autoware_auto_control_msgs/msg/ackermann_control_command.hpp>
Expand Down

0 comments on commit 6c5cb9b

Please sign in to comment.