Skip to content

Commit

Permalink
style(pre-commit): autofix
Browse files Browse the repository at this point in the history
  • Loading branch information
pre-commit-ci[bot] authored and mitsudome-r committed Jan 20, 2025
1 parent ea15e64 commit 328b166
Show file tree
Hide file tree
Showing 6 changed files with 18 additions and 16 deletions.
Original file line number Diff line number Diff line change
Expand Up @@ -387,4 +387,5 @@ void DefaultPlanner::clearRoute()

#include <pluginlib/class_list_macros.hpp>
PLUGINLIB_EXPORT_CLASS(
autoware::mission_planner_universe::lanelet2::DefaultPlanner, autoware::mission_planner_universe::PlannerPlugin)
autoware::mission_planner_universe::lanelet2::DefaultPlanner,
autoware::mission_planner_universe::PlannerPlugin)
Original file line number Diff line number Diff line change
Expand Up @@ -12,8 +12,8 @@
// See the License for the specific language governing permissions and
// limitations under the License.

#ifndef MISSION_PLANNER_UNIVERSE__ARRIVAL_CHECKER_HPP_
#define MISSION_PLANNER_UNIVERSE__ARRIVAL_CHECKER_HPP_
#ifndef MISSION_PLANNER__ARRIVAL_CHECKER_HPP_
#define MISSION_PLANNER__ARRIVAL_CHECKER_HPP_

#include <autoware/motion_utils/vehicle/vehicle_state_checker.hpp>
#include <rclcpp/rclcpp.hpp>
Expand Down Expand Up @@ -46,4 +46,4 @@ class ArrivalChecker

} // namespace autoware::mission_planner_universe

#endif // MISSION_PLANNER_UNIVERSE__ARRIVAL_CHECKER_HPP_
#endif // MISSION_PLANNER__ARRIVAL_CHECKER_HPP_
Original file line number Diff line number Diff line change
Expand Up @@ -38,7 +38,8 @@ namespace autoware::mission_planner_universe
MissionPlanner::MissionPlanner(const rclcpp::NodeOptions & options)
: Node("mission_planner", options),
arrival_checker_(this),
plugin_loader_("autoware_mission_planner_universe", "autoware::mission_planner_universe::PlannerPlugin"),
plugin_loader_(
"autoware_mission_planner_universe", "autoware::mission_planner_universe::PlannerPlugin"),
tf_buffer_(get_clock()),
tf_listener_(tf_buffer_),
odometry_(nullptr),
Expand All @@ -52,8 +53,8 @@ MissionPlanner::MissionPlanner(const rclcpp::NodeOptions & options)
minimum_reroute_length_ = declare_parameter<double>("minimum_reroute_length");
allow_reroute_in_autonomous_mode_ = declare_parameter<bool>("allow_reroute_in_autonomous_mode");

planner_ =
plugin_loader_.createSharedInstance("autoware::mission_planner_universe::lanelet2::DefaultPlanner");
planner_ = plugin_loader_.createSharedInstance(
"autoware::mission_planner_universe::lanelet2::DefaultPlanner");
planner_->initialize(this);

const auto durable_qos = rclcpp::QoS(1).transient_local();
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -12,8 +12,8 @@
// See the License for the specific language governing permissions and
// limitations under the License.

#ifndef MISSION_PLANNER_UNIVERSE__MISSION_PLANNER_HPP_
#define MISSION_PLANNER_UNIVERSE__MISSION_PLANNER_HPP_
#ifndef MISSION_PLANNER__MISSION_PLANNER_HPP_
#define MISSION_PLANNER__MISSION_PLANNER_HPP_

#include "arrival_checker.hpp"
#include "autoware/universe_utils/ros/polling_subscriber.hpp"
Expand Down Expand Up @@ -152,4 +152,4 @@ class MissionPlanner : public rclcpp::Node

} // namespace autoware::mission_planner_universe

#endif // MISSION_PLANNER_UNIVERSE__MISSION_PLANNER_HPP_
#endif // MISSION_PLANNER__MISSION_PLANNER_HPP_
Original file line number Diff line number Diff line change
Expand Up @@ -12,8 +12,8 @@
// See the License for the specific language governing permissions and
// limitations under the License.

#ifndef MISSION_PLANNER_UNIVERSE__ROUTE_SELECTOR_HPP_
#define MISSION_PLANNER_UNIVERSE__ROUTE_SELECTOR_HPP_
#ifndef MISSION_PLANNER__ROUTE_SELECTOR_HPP_
#define MISSION_PLANNER__ROUTE_SELECTOR_HPP_

#include <autoware/universe_utils/system/stop_watch.hpp>
#include <rclcpp/rclcpp.hpp>
Expand Down Expand Up @@ -109,4 +109,4 @@ class RouteSelector : public rclcpp::Node

} // namespace autoware::mission_planner_universe

#endif // MISSION_PLANNER_UNIVERSE__ROUTE_SELECTOR_HPP_
#endif // MISSION_PLANNER__ROUTE_SELECTOR_HPP_
Original file line number Diff line number Diff line change
Expand Up @@ -12,8 +12,8 @@
// See the License for the specific language governing permissions and
// limitations under the License.

#ifndef MISSION_PLANNER_UNIVERSE__SERVICE_UTILS_HPP_
#define MISSION_PLANNER_UNIVERSE__SERVICE_UTILS_HPP_
#ifndef MISSION_PLANNER__SERVICE_UTILS_HPP_
#define MISSION_PLANNER__SERVICE_UTILS_HPP_

#include <autoware/universe_utils/system/stop_watch.hpp>

Expand Down Expand Up @@ -82,4 +82,4 @@ ResponseStatus sync_call(T & client, Req req)

} // namespace service_utils

#endif // MISSION_PLANNER_UNIVERSE__SERVICE_UTILS_HPP_
#endif // MISSION_PLANNER__SERVICE_UTILS_HPP_

0 comments on commit 328b166

Please sign in to comment.