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] committed Feb 27, 2024
1 parent be3ff29 commit 0b57570
Show file tree
Hide file tree
Showing 9 changed files with 17 additions and 18 deletions.
2 changes: 1 addition & 1 deletion common/component_interface_specs/package.xml
Original file line number Diff line number Diff line change
Expand Up @@ -15,8 +15,8 @@
<depend>autoware_auto_perception_msgs</depend>
<depend>autoware_auto_planning_msgs</depend>
<depend>autoware_auto_vehicle_msgs</depend>
<depend>autoware_planning_msgs</depend>
<depend>autoware_map_msgs</depend>
<depend>autoware_planning_msgs</depend>
<depend>nav_msgs</depend>
<depend>rcl</depend>
<depend>rclcpp</depend>
Expand Down
2 changes: 1 addition & 1 deletion map/autoware_dynamic_lanelet_provider/CMakeLists.txt
Original file line number Diff line number Diff line change
Expand Up @@ -16,4 +16,4 @@ rclcpp_components_register_node(dynamic_lanelet_provider_node
ament_auto_package(INSTALL_TO_SHARE
launch
config
)
)
Original file line number Diff line number Diff line change
Expand Up @@ -2,4 +2,4 @@
ros__parameters:
dynamic_map_loading_grid_size: 50.0 # [m]
dynamic_map_loading_update_distance: 100.0 # [m]
dynamic_map_loading_map_radius: 150.0 # [m]
dynamic_map_loading_map_radius: 150.0 # [m]
Original file line number Diff line number Diff line change
@@ -1,7 +1,7 @@


#ifndef AUTOWARE_DYNAMIC_LANELET_PROVIDER_HPP
#define AUTOWARE_DYNAMIC_LANELET_PROVIDER_HPP
#ifndef AUTOWARE__DYNAMIC_LANELET_PROVIDER__DYNAMIC_LANELET_PROVIDER_HPP_
#define AUTOWARE__DYNAMIC_LANELET_PROVIDER__DYNAMIC_LANELET_PROVIDER_HPP_

#include <component_interface_specs/map.hpp>
#include <component_interface_utils/rclcpp.hpp>
Expand Down Expand Up @@ -74,4 +74,4 @@ class DynamicLaneletProviderNode : public rclcpp::Node
} // namespace dynamic_lanelet_provider
} // namespace autoware

#endif // AUTOWARE_DYNAMIC_LANELET_PROVIDER_HPP
#endif // AUTOWARE__DYNAMIC_LANELET_PROVIDER__DYNAMIC_LANELET_PROVIDER_HPP_
Original file line number Diff line number Diff line change
@@ -1,8 +1,7 @@
<launch>
<arg name="dynamic_lanelet_provider_param_path" default="$(find-pkg-share autoware_dynamic_lanelet_provider)/config/dynamic_lanelet_provider.param.yaml"/>
<arg name="dynamic_lanelet_provider_param_path" default="$(find-pkg-share autoware_dynamic_lanelet_provider)/config/dynamic_lanelet_provider.param.yaml"/>

<node pkg="autoware_dynamic_lanelet_provider" exec="dynamic_lanelet_provider_node" name="dynamic_lanelet_provider_node">
<param from="$(var dynamic_lanelet_provider_param_path)"/>
</node>

</launch>
<node pkg="autoware_dynamic_lanelet_provider" exec="dynamic_lanelet_provider_node" name="dynamic_lanelet_provider_node">
<param from="$(var dynamic_lanelet_provider_param_path)"/>
</node>
</launch>
4 changes: 2 additions & 2 deletions map/autoware_dynamic_lanelet_provider/package.xml
Original file line number Diff line number Diff line change
Expand Up @@ -10,10 +10,10 @@
<buildtool_depend>ament_cmake_auto</buildtool_depend>
<buildtool_depend>autoware_cmake</buildtool_depend>

<depend>component_interface_specs</depend>
<depend>component_interface_utils</depend>
<depend>autoware_auto_mapping_msgs</depend>
<depend>autoware_map_msgs</depend>
<depend>component_interface_specs</depend>
<depend>component_interface_utils</depend>
<depend>geography_utils</depend>

<export>
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -144,7 +144,8 @@ void DynamicLaneletProviderNode::updateMap(const geometry_msgs::msg::Point & pos
}

auto request = std::make_shared<autoware_map_msgs::srv::GetDifferentialLanelet2Map::Request>();
request->vector_map_file_ids.insert(request->vector_map_file_ids.end(), cache_ids.begin(), cache_ids.end());
request->vector_map_file_ids.insert(
request->vector_map_file_ids.end(), cache_ids.begin(), cache_ids.end());

while (!map_loader_client_->wait_for_service(std::chrono::seconds(1)) && rclcpp::ok()) {
RCLCPP_INFO(get_logger(), "Waiting for lanelet loader service");
Expand Down Expand Up @@ -196,4 +197,4 @@ bool DynamicLaneletProviderNode::should_update_map() const
} // namespace autoware

#include <rclcpp_components/rclcpp_components/register_node_macro.hpp>
RCLCPP_COMPONENTS_REGISTER_NODE(autoware::dynamic_lanelet_provider::DynamicLaneletProviderNode)
RCLCPP_COMPONENTS_REGISTER_NODE(autoware::dynamic_lanelet_provider::DynamicLaneletProviderNode)
Original file line number Diff line number Diff line change
Expand Up @@ -136,7 +136,6 @@ Lanelet2DifferentialLoaderModule::getLaneletMapMetaDataMsg() const
tile_msg.origin_lat = file.second.origin_lat;
tile_msg.origin_lon = file.second.origin_lon;


metadata.metadata_list.push_back(tile_msg);
}
metadata.header.frame_id = "map";
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -82,7 +82,7 @@ Lanelet2MapLoaderNode::Lanelet2MapLoaderNode(const rclcpp::NodeOptions & options

declare_parameter<std::string>("lanelet2_map_path");
declare_parameter<double>("center_line_resolution");

if (declare_parameter<bool>("enabled_dynamic_lanelet_loading")) {
std::vector<std::string> lanelet2_paths_or_directory =
declare_parameter<std::vector<std::string>>("lanelet2_map_folder_path");
Expand Down

0 comments on commit 0b57570

Please sign in to comment.