Skip to content

Commit

Permalink
updated linter suggestions
Browse files Browse the repository at this point in the history
  • Loading branch information
Lukasnol committed Dec 18, 2024
1 parent 72c0641 commit 7df05ad
Showing 1 changed file with 2 additions and 6 deletions.
8 changes: 2 additions & 6 deletions code/perception/src/Lanedetection_node.py
Original file line number Diff line number Diff line change
Expand Up @@ -2,8 +2,6 @@

from ros_compatibility.node import CompatibleNode
from rospy.numpy_msg import numpy_msg
import rospy
import numpy as np
import ros_compatibility as roscomp
import cv2
from sensor_msgs.msg import Image as ImageMsg
Expand All @@ -14,16 +12,14 @@
import torch
from PIL import Image
import torchvision.transforms as t
from sklearn.cluster import DBSCAN
from sklearn.preprocessing import StandardScaler
from visualization_msgs.msg import Marker, MarkerArray


class Lanedetection_node(CompatibleNode):
"""YOLOP:
Model for Lanedetection and Driveable Area Detection
subscribes to camera image and publishes lane masks and driveable area for further planning
subscribes to camera image and publishes lane masks and driveable area for further
planning
"""

def __init__(self, name, **kwargs):
Expand Down

0 comments on commit 7df05ad

Please sign in to comment.