Skip to content

Commit

Permalink
chore: changed includes to quotes instead of brackets
Browse files Browse the repository at this point in the history
Signed-off-by: Kenzo Lobos-Tsunekawa <[email protected]>
  • Loading branch information
knzo25 committed Jun 3, 2024
1 parent 1f634a7 commit f3187e9
Show file tree
Hide file tree
Showing 24 changed files with 97 additions and 105 deletions.
Original file line number Diff line number Diff line change
Expand Up @@ -15,15 +15,14 @@
#ifndef LIDAR_CENTERPOINT__CENTERPOINT_TRT_HPP_
#define LIDAR_CENTERPOINT__CENTERPOINT_TRT_HPP_

#include <lidar_centerpoint/cuda_utils.hpp>
#include <lidar_centerpoint/network/network_trt.hpp>
#include <lidar_centerpoint/postprocess/postprocess_kernel.hpp>
#include <lidar_centerpoint/preprocess/voxel_generator.hpp>

#include <sensor_msgs/msg/point_cloud2.hpp>

#include <pcl/point_cloud.h>
#include <pcl/point_types.h>
#include "lidar_centerpoint/cuda_utils.hpp"
#include "lidar_centerpoint/network/network_trt.hpp"
#include "lidar_centerpoint/postprocess/postprocess_kernel.hpp"
#include "lidar_centerpoint/preprocess/voxel_generator.hpp"
#include "pcl/point_cloud.h"
#include "pcl/point_types.h"

#include "sensor_msgs/msg/point_cloud2.hpp"

#include <memory>
#include <string>
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -42,7 +42,7 @@
#ifndef LIDAR_CENTERPOINT__CUDA_UTILS_HPP_
#define LIDAR_CENTERPOINT__CUDA_UTILS_HPP_

#include <cuda_runtime_api.h>
#include "cuda_runtime_api.h"

#include <memory>
#include <sstream>
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -17,10 +17,10 @@

#include <Eigen/Core>

#include <autoware_auto_perception_msgs/msg/detected_object_kinematics.hpp>
#include <autoware_auto_perception_msgs/msg/detected_objects.hpp>
#include <autoware_auto_perception_msgs/msg/object_classification.hpp>
#include <autoware_auto_perception_msgs/msg/shape.hpp>
#include "autoware_auto_perception_msgs/msg/detected_object_kinematics.hpp"
#include "autoware_auto_perception_msgs/msg/detected_objects.hpp"
#include "autoware_auto_perception_msgs/msg/object_classification.hpp"
#include "autoware_auto_perception_msgs/msg/shape.hpp"

#include <vector>

Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -15,8 +15,8 @@
#ifndef LIDAR_CENTERPOINT__NETWORK__NETWORK_TRT_HPP_
#define LIDAR_CENTERPOINT__NETWORK__NETWORK_TRT_HPP_

#include <lidar_centerpoint/centerpoint_config.hpp>
#include <lidar_centerpoint/network/tensorrt_wrapper.hpp>
#include "lidar_centerpoint/centerpoint_config.hpp"
#include "lidar_centerpoint/network/tensorrt_wrapper.hpp"

#include <vector>

Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -15,8 +15,8 @@
#ifndef LIDAR_CENTERPOINT__NETWORK__SCATTER_KERNEL_HPP_
#define LIDAR_CENTERPOINT__NETWORK__SCATTER_KERNEL_HPP_

#include <cuda.h>
#include <cuda_runtime_api.h>
#include "cuda.h"
#include "cuda_runtime_api.h"

namespace centerpoint
{
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -15,10 +15,9 @@
#ifndef LIDAR_CENTERPOINT__NETWORK__TENSORRT_WRAPPER_HPP_
#define LIDAR_CENTERPOINT__NETWORK__TENSORRT_WRAPPER_HPP_

#include <lidar_centerpoint/centerpoint_config.hpp>
#include <tensorrt_common/tensorrt_common.hpp>

#include <NvInfer.h>
#include "NvInfer.h"
#include "lidar_centerpoint/centerpoint_config.hpp"
#include "tensorrt_common/tensorrt_common.hpp"

#include <iostream>
#include <memory>
Expand Down
25 changes: 12 additions & 13 deletions perception/lidar_centerpoint/include/lidar_centerpoint/node.hpp
Original file line number Diff line number Diff line change
Expand Up @@ -15,20 +15,19 @@
#ifndef LIDAR_CENTERPOINT__NODE_HPP_
#define LIDAR_CENTERPOINT__NODE_HPP_

#include "lidar_centerpoint/centerpoint_trt.hpp"
#include "lidar_centerpoint/detection_class_remapper.hpp"
#include "lidar_centerpoint/postprocess/non_maximum_suppression.hpp"

#include <lidar_centerpoint/centerpoint_trt.hpp>
#include <lidar_centerpoint/detection_class_remapper.hpp>
#include <rclcpp/rclcpp.hpp>
#include <tier4_autoware_utils/ros/debug_publisher.hpp>
#include <tier4_autoware_utils/ros/published_time_publisher.hpp>
#include <tier4_autoware_utils/system/stop_watch.hpp>

#include <autoware_auto_perception_msgs/msg/detected_object_kinematics.hpp>
#include <autoware_auto_perception_msgs/msg/detected_objects.hpp>
#include <autoware_auto_perception_msgs/msg/object_classification.hpp>
#include <autoware_auto_perception_msgs/msg/shape.hpp>
#include <sensor_msgs/msg/point_cloud2.hpp>
#include "rclcpp/rclcpp.hpp"
#include "tier4_autoware_utils/ros/debug_publisher.hpp"
#include "tier4_autoware_utils/ros/published_time_publisher.hpp"
#include "tier4_autoware_utils/system/stop_watch.hpp"

#include "autoware_auto_perception_msgs/msg/detected_object_kinematics.hpp"
#include "autoware_auto_perception_msgs/msg/detected_objects.hpp"
#include "autoware_auto_perception_msgs/msg/object_classification.hpp"
#include "autoware_auto_perception_msgs/msg/shape.hpp"
#include "sensor_msgs/msg/point_cloud2.hpp"

#include <memory>
#include <string>
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -15,9 +15,8 @@
#ifndef LIDAR_CENTERPOINT__POSTPROCESS__CIRCLE_NMS_KERNEL_HPP_
#define LIDAR_CENTERPOINT__POSTPROCESS__CIRCLE_NMS_KERNEL_HPP_

#include <lidar_centerpoint/utils.hpp>

#include <thrust/device_vector.h>
#include "lidar_centerpoint/utils.hpp"
#include "thrust/device_vector.h"

namespace centerpoint
{
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -15,12 +15,11 @@
#ifndef LIDAR_CENTERPOINT__POSTPROCESS__POSTPROCESS_KERNEL_HPP_
#define LIDAR_CENTERPOINT__POSTPROCESS__POSTPROCESS_KERNEL_HPP_

#include <lidar_centerpoint/centerpoint_config.hpp>
#include <lidar_centerpoint/utils.hpp>

#include <cuda.h>
#include <cuda_runtime_api.h>
#include <thrust/device_vector.h>
#include "cuda.h"
#include "cuda_runtime_api.h"
#include "lidar_centerpoint/centerpoint_config.hpp"
#include "lidar_centerpoint/utils.hpp"
#include "thrust/device_vector.h"

#include <vector>

Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -15,19 +15,19 @@
#ifndef LIDAR_CENTERPOINT__PREPROCESS__POINTCLOUD_DENSIFICATION_HPP_
#define LIDAR_CENTERPOINT__PREPROCESS__POINTCLOUD_DENSIFICATION_HPP_

#include <lidar_centerpoint/cuda_utils.hpp>
#include "tf2_ros/buffer.h"
#include "tf2_ros/transform_listener.h"

#include <tf2_ros/buffer.h>
#include <tf2_ros/transform_listener.h>
#include <list>
#include <string>
#include <utility>
#ifdef ROS_DISTRO_GALACTIC
#include <tf2_sensor_msgs/tf2_sensor_msgs.h>
#include "tf2_sensor_msgs/tf2_sensor_msgs.h"
#else
#include <tf2_sensor_msgs/tf2_sensor_msgs.hpp>
#include "tf2_sensor_msgs/tf2_sensor_msgs.hpp"
#endif

#include <list>
#include <string>
#include <utility>
#include "lidar_centerpoint/cuda_utils.hpp"

namespace centerpoint
{
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -15,8 +15,8 @@
#ifndef LIDAR_CENTERPOINT__PREPROCESS__PREPROCESS_KERNEL_HPP_
#define LIDAR_CENTERPOINT__PREPROCESS__PREPROCESS_KERNEL_HPP_

#include <cuda.h>
#include <cuda_runtime_api.h>
#include "cuda.h"
#include "cuda_runtime_api.h"

namespace centerpoint
{
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -15,10 +15,10 @@
#ifndef LIDAR_CENTERPOINT__PREPROCESS__VOXEL_GENERATOR_HPP_
#define LIDAR_CENTERPOINT__PREPROCESS__VOXEL_GENERATOR_HPP_

#include <lidar_centerpoint/centerpoint_config.hpp>
#include <lidar_centerpoint/preprocess/pointcloud_densification.hpp>
#include "lidar_centerpoint/centerpoint_config.hpp"
#include "lidar_centerpoint/preprocess/pointcloud_densification.hpp"

#include <sensor_msgs/msg/point_cloud2.hpp>
#include "sensor_msgs/msg/point_cloud2.hpp"

#include <memory>
#include <vector>
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -17,12 +17,12 @@

// ros packages cannot be included from cuda.

#include <lidar_centerpoint/utils.hpp>
#include "lidar_centerpoint/utils.hpp"

#include <autoware_auto_perception_msgs/msg/detected_object_kinematics.hpp>
#include <autoware_auto_perception_msgs/msg/detected_objects.hpp>
#include <autoware_auto_perception_msgs/msg/object_classification.hpp>
#include <autoware_auto_perception_msgs/msg/shape.hpp>
#include "autoware_auto_perception_msgs/msg/detected_object_kinematics.hpp"
#include "autoware_auto_perception_msgs/msg/detected_objects.hpp"
#include "autoware_auto_perception_msgs/msg/object_classification.hpp"
#include "autoware_auto_perception_msgs/msg/shape.hpp"

#include <string>
#include <vector>
Expand Down
8 changes: 4 additions & 4 deletions perception/lidar_centerpoint/lib/centerpoint_trt.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -14,10 +14,10 @@

#include "lidar_centerpoint/centerpoint_trt.hpp"

#include <lidar_centerpoint/centerpoint_config.hpp>
#include <lidar_centerpoint/network/scatter_kernel.hpp>
#include <lidar_centerpoint/preprocess/preprocess_kernel.hpp>
#include <tier4_autoware_utils/math/constants.hpp>
#include "lidar_centerpoint/centerpoint_config.hpp"
#include "lidar_centerpoint/network/scatter_kernel.hpp"
#include "lidar_centerpoint/preprocess/preprocess_kernel.hpp"
#include "tier4_autoware_utils/math/constants.hpp"

#include <iostream>
#include <memory>
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -12,7 +12,7 @@
// See the License for the specific language governing permissions and
// limitations under the License.

#include <lidar_centerpoint/detection_class_remapper.hpp>
#include "lidar_centerpoint/detection_class_remapper.hpp"

namespace centerpoint
{
Expand Down
3 changes: 1 addition & 2 deletions perception/lidar_centerpoint/lib/network/scatter_kernel.cu
Original file line number Diff line number Diff line change
Expand Up @@ -13,8 +13,7 @@
// limitations under the License.

#include "lidar_centerpoint/network/scatter_kernel.hpp"

#include <lidar_centerpoint/utils.hpp>
#include "lidar_centerpoint/utils.hpp"

namespace
{
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -14,7 +14,7 @@

#include "lidar_centerpoint/network/tensorrt_wrapper.hpp"

#include <NvOnnxParser.h>
#include "NvOnnxParser.h"

#include <fstream>
#include <memory>
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -21,12 +21,10 @@ Written by Shaoshuai Shi
All Rights Reserved 2019-2020.
*/

#include "lidar_centerpoint/cuda_utils.hpp"
#include "lidar_centerpoint/postprocess/circle_nms_kernel.hpp"

#include <lidar_centerpoint/cuda_utils.hpp>
#include <lidar_centerpoint/utils.hpp>

#include <thrust/host_vector.h>
#include "lidar_centerpoint/utils.hpp"
#include "thrust/host_vector.h"

namespace
{
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -17,6 +17,7 @@
#include "object_recognition_utils/geometry.hpp"
#include "object_recognition_utils/object_recognition_utils.hpp"
#include "tier4_autoware_utils/geometry/geometry.hpp"

namespace centerpoint
{

Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -13,12 +13,10 @@
// limitations under the License.

#include "lidar_centerpoint/postprocess/circle_nms_kernel.hpp"

#include <lidar_centerpoint/postprocess/postprocess_kernel.hpp>

#include <thrust/count.h>
#include <thrust/device_vector.h>
#include <thrust/sort.h>
#include "lidar_centerpoint/postprocess/postprocess_kernel.hpp"
#include "thrust/count.h"
#include "thrust/device_vector.h"
#include "thrust/sort.h"

namespace
{
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -14,20 +14,19 @@

#include "lidar_centerpoint/preprocess/pointcloud_densification.hpp"

#include <pcl_ros/transforms.hpp>
#include "pcl_conversions/pcl_conversions.h"
#include "pcl_ros/transforms.hpp"

#include <boost/optional.hpp>
#include "boost/optional.hpp"

#include <pcl_conversions/pcl_conversions.h>
#include <string>
#include <utility>
#ifdef ROS_DISTRO_GALACTIC
#include <tf2_eigen/tf2_eigen.h>
#include "tf2_eigen/tf2_eigen.h"
#else
#include <tf2_eigen/tf2_eigen.hpp>
#include "tf2_eigen/tf2_eigen.hpp"
#endif

#include <string>
#include <utility>

namespace
{
boost::optional<geometry_msgs::msg::Transform> getTransform(
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -28,11 +28,12 @@
* limitations under the License.
*/

#include <lidar_centerpoint/cuda_utils.hpp>
#include <lidar_centerpoint/preprocess/preprocess_kernel.hpp>
#include <lidar_centerpoint/utils.hpp>
#include "lidar_centerpoint/cuda_utils.hpp"
#include "lidar_centerpoint/preprocess/preprocess_kernel.hpp"
#include "lidar_centerpoint/utils.hpp"

#include <cassert>

namespace
{
const std::size_t MAX_POINT_IN_VOXEL_SIZE = 32; // the same as max_point_in_voxel_size_ in config
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -14,9 +14,9 @@

#include "lidar_centerpoint/preprocess/voxel_generator.hpp"

#include <lidar_centerpoint/preprocess/preprocess_kernel.hpp>
#include "lidar_centerpoint/preprocess/preprocess_kernel.hpp"

#include <sensor_msgs/point_cloud2_iterator.hpp>
#include "sensor_msgs/point_cloud2_iterator.hpp"

namespace centerpoint
{
Expand Down
23 changes: 12 additions & 11 deletions perception/lidar_centerpoint/src/node.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -14,17 +14,7 @@

#include "lidar_centerpoint/node.hpp"

#include <lidar_centerpoint/centerpoint_config.hpp>
#include <lidar_centerpoint/preprocess/pointcloud_densification.hpp>
#include <lidar_centerpoint/ros_utils.hpp>
#include <lidar_centerpoint/utils.hpp>
#include <pcl_ros/transforms.hpp>

#ifdef ROS_DISTRO_GALACTIC
#include <tf2_geometry_msgs/tf2_geometry_msgs.h>
#else
#include <tf2_geometry_msgs/tf2_geometry_msgs.hpp>
#endif
#include "pcl_ros/transforms.hpp"

#include <Eigen/Dense>
#include <Eigen/Geometry>
Expand All @@ -33,6 +23,17 @@
#include <string>
#include <vector>

#ifdef ROS_DISTRO_GALACTIC
#include "tf2_geometry_msgs/tf2_geometry_msgs.h"
#else
#include "tf2_geometry_msgs/tf2_geometry_msgs.hpp"
#endif

#include "lidar_centerpoint/centerpoint_config.hpp"
#include "lidar_centerpoint/preprocess/pointcloud_densification.hpp"
#include "lidar_centerpoint/ros_utils.hpp"
#include "lidar_centerpoint/utils.hpp"

namespace centerpoint
{
LidarCenterPointNode::LidarCenterPointNode(const rclcpp::NodeOptions & node_options)
Expand Down

0 comments on commit f3187e9

Please sign in to comment.