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 Mar 23, 2022
1 parent 7e48158 commit 99b7877
Show file tree
Hide file tree
Showing 4 changed files with 8 additions and 8 deletions.
6 changes: 3 additions & 3 deletions perception/pointpainting/CMakeLists.txt
Original file line number Diff line number Diff line change
Expand Up @@ -125,7 +125,7 @@ if(TRT_AVAIL AND CUDA_AVAIL AND TORCH_AVAIL)
# ${CUDA_INCLUDE_DIRS}
# ${TORCH_INCLUDE_DIRS}
)

### centerpoint ###
# ament_auto_add_library(centerpoint SHARED
# lib/src/pointcloud_densification.cpp
Expand Down Expand Up @@ -160,7 +160,7 @@ if(TRT_AVAIL AND CUDA_AVAIL AND TORCH_AVAIL)
PLUGIN "pointpainting::PointPaintingNode"
EXECUTABLE pointpainting_node
)

if(BUILD_TESTING)
find_package(ament_lint_auto REQUIRED)
ament_lint_auto_find_test_dependencies()
Expand All @@ -185,4 +185,4 @@ else()
INSTALL_TO_SHARE
launch
)
endif()
endif()
2 changes: 1 addition & 1 deletion perception/pointpainting/include/pointpainting/node.hpp
Original file line number Diff line number Diff line change
Expand Up @@ -139,4 +139,4 @@ class PointPaintingNode : public rclcpp::Node

} // namespace pointpainting

#endif // POINTPAINTING__NODE_HPP_
#endif // POINTPAINTING__NODE_HPP_
6 changes: 3 additions & 3 deletions perception/pointpainting/package.xml
Original file line number Diff line number Diff line change
Expand Up @@ -10,20 +10,20 @@

<buildtool_depend>ament_cmake_auto</buildtool_depend>

<depend>autoware_auto_perception_msgs</depend>
<depend>cv_bridge</depend>
<depend>image_transport</depend>
<depend>message_filters</depend>
<depend>pcl_conversions</depend>
<depend>autoware_auto_perception_msgs</depend>
<depend>pcl_ros</depend>
<depend>rclcpp</depend>
<depend>rclcpp_components</depend>
<depend>tf2_geometry_msgs</depend>
<depend>tier4_autoware_utils</depend>
<depend>sensor_msgs</depend>
<depend>tf2</depend>
<depend>tf2_geometry_msgs</depend>
<depend>tf2_ros</depend>
<depend>tf2_sensor_msgs</depend>
<depend>tier4_autoware_utils</depend>
<depend>tier4_perception_msgs</depend>

<test_depend>ament_lint_auto</test_depend>
Expand Down
2 changes: 1 addition & 1 deletion perception/pointpainting/src/node.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -300,4 +300,4 @@ void PointPaintingNode::fusionCallback(
} // namespace pointpainting

#include <rclcpp_components/register_node_macro.hpp>
RCLCPP_COMPONENTS_REGISTER_NODE(pointpainting::PointPaintingNode)
RCLCPP_COMPONENTS_REGISTER_NODE(pointpainting::PointPaintingNode)

0 comments on commit 99b7877

Please sign in to comment.