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] committed Sep 27, 2024
1 parent a684360 commit e4ff21b
Show file tree
Hide file tree
Showing 4 changed files with 8 additions and 11 deletions.
4 changes: 2 additions & 2 deletions control/autonomous_emergency_braking/package.xml
Original file line number Diff line number Diff line change
Expand Up @@ -11,6 +11,8 @@
<buildtool_depend>autoware_cmake</buildtool_depend>
<test_depend>ament_cmake_ros</test_depend>
<test_depend>ament_lint_auto</test_depend>
<test_depend>ament_lint_auto</test_depend>
<test_depend>autoware_lint_common</test_depend>
<test_depend>autoware_lint_common</test_depend>

<build_depend>autoware_cmake</build_depend>
Expand All @@ -36,8 +38,6 @@
<depend>vehicle_info_util</depend>
<depend>visualization_msgs</depend>

<test_depend>ament_lint_auto</test_depend>
<test_depend>autoware_lint_common</test_depend>

<export>
<build_type>ament_cmake</build_type>
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -47,7 +47,6 @@ using LaneletRoute = autoware_auto_planning_msgs::msg::HADMapRoute;
using geometry_msgs::msg::AccelWithCovarianceStamped;
using sensor_msgs::msg::Imu;


/**
* @brief Node for control evaluation
*/
Expand All @@ -64,8 +63,7 @@ class ControlEvaluatorNode : public rclcpp::Node

DiagnosticStatus generateAEBDiagnosticStatus(const DiagnosticStatus & diag);
DiagnosticStatus generateLaneletDiagnosticStatus(const Pose & ego_pose) const;
DiagnosticStatus generateKinematicStateDiagnosticStatus(
const Odometry & odom, const Imu & imu);
DiagnosticStatus generateKinematicStateDiagnosticStatus(const Odometry & odom, const Imu & imu);

void onDiagnostics(const DiagnosticArray::ConstSharedPtr diag_msg);
void onTimer();
Expand All @@ -80,8 +78,7 @@ class ControlEvaluatorNode : public rclcpp::Node
this, "~/input/odometry"};
// autoware::universe_utils::InterProcessPollingSubscriber<AccelWithCovarianceStamped> accel_sub_{
// this, "~/input/acceleration"};
autoware::universe_utils::InterProcessPollingSubscriber<Imu> imu_sub_{
this, "~/input/imu"};
autoware::universe_utils::InterProcessPollingSubscriber<Imu> imu_sub_{this, "~/input/imu"};
autoware::universe_utils::InterProcessPollingSubscriber<Trajectory> traj_sub_{
this, "~/input/trajectory"};
autoware::universe_utils::InterProcessPollingSubscriber<
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -15,8 +15,8 @@
#ifndef AUTOWARE__CONTROL_EVALUATOR__METRICS__DEVIATION_METRICS_HPP_
#define AUTOWARE__CONTROL_EVALUATOR__METRICS__DEVIATION_METRICS_HPP_

#include "autoware_auto_planning_msgs/msg/trajectory_point.hpp"
#include "autoware_auto_planning_msgs/msg/trajectory.hpp"
#include "autoware_auto_planning_msgs/msg/trajectory_point.hpp"

namespace control_diagnostics
{
Expand Down
6 changes: 3 additions & 3 deletions control/autoware_control_evaluator/package.xml
Original file line number Diff line number Diff line change
Expand Up @@ -14,14 +14,14 @@
<buildtool_depend>ament_cmake_auto</buildtool_depend>
<buildtool_depend>autoware_cmake</buildtool_depend>

<depend>autoware_evaluator_utils</depend>
<depend>tier4_autoware_utils</depend>
<depend>autoware_auto_planning_msgs</depend>
<depend>route_handler</depend>
<depend>autoware_evaluator_utils</depend>
<depend>diagnostic_msgs</depend>
<depend>pluginlib</depend>
<depend>rclcpp</depend>
<depend>rclcpp_components</depend>
<depend>route_handler</depend>
<depend>tier4_autoware_utils</depend>
<!-- <depend>nav_msgs</depend> -->

<test_depend>ament_cmake_ros</test_depend>
Expand Down

0 comments on commit e4ff21b

Please sign in to comment.