diff --git a/control/autoware_control_performance_analysis/scripts/control_performance_plot.py b/control/autoware_control_performance_analysis/scripts/control_performance_plot.py index f129b4298736b..a30266a32809f 100644 --- a/control/autoware_control_performance_analysis/scripts/control_performance_plot.py +++ b/control/autoware_control_performance_analysis/scripts/control_performance_plot.py @@ -17,9 +17,9 @@ import argparse import math -from autoware_internal_debug_msgs.msg import BoolStamped from autoware_control_performance_analysis.msg import DrivingMonitorStamped from autoware_control_performance_analysis.msg import ErrorStamped +from autoware_internal_debug_msgs.msg import BoolStamped import matplotlib.pyplot as plt from nav_msgs.msg import Odometry import rclpy