Skip to content

Commit

Permalink
fixing styling
Browse files Browse the repository at this point in the history
  • Loading branch information
danielrhuynh committed Apr 4, 2024
1 parent 0efbca2 commit 92723b6
Show file tree
Hide file tree
Showing 2 changed files with 8 additions and 6 deletions.
Original file line number Diff line number Diff line change
Expand Up @@ -3,6 +3,7 @@
from ament_index_python.packages import get_package_share_directory
import os


def generate_launch_description():
ld = LaunchDescription()
config = os.path.join(
Expand Down
Original file line number Diff line number Diff line change
@@ -1,3 +1,9 @@
# pylint: disable=wrong-import-position
sys.path.append("/home/bolty/OpenPCDet")
from pcdet.utils import common_utils
from pcdet.models import build_network, load_data_to_gpu
from pcdet.datasets import DatasetTemplate
from pcdet.config import cfg, cfg_from_yaml_file
import sys
import argparse
import rclpy
Expand All @@ -8,12 +14,6 @@
from vision_msgs.msg import ObjectHypothesisWithPose, Detection3D, Detection3DArray
from sensor_msgs.msg import PointCloud2, PointField

# pylint: disable=wrong-import-position
sys.path.append("/home/bolty/OpenPCDet")
from pcdet.config import cfg, cfg_from_yaml_file
from pcdet.datasets import DatasetTemplate
from pcdet.models import build_network, load_data_to_gpu
from pcdet.utils import common_utils

class LidarObjectDetection(Node):
def __init__(self):
Expand Down Expand Up @@ -204,5 +204,6 @@ def main(args=None):
node.destroy_node()
rclpy.shutdown()


if __name__ == '__main__':
main()

0 comments on commit 92723b6

Please sign in to comment.