Open danielv012 opened 6 months ago
Status- Status-
Status- In progress(almost about to be done) next- trying if it works with ros2 bag Projected completion- week of 16th September update-
Status- bug fixed the code is running, but it is not detecting traffic lights next- Doesnot work with ros2 bag Projected completion- By th end of October update-
for bug fixing to test this code( to be done)- import rclpy from rclpy.node import Node from sensor_msgs.msg import Image from cv_bridge import CvBridge from navigator_msgs.msg import TrafficLightDetection, TrafficLight
import torch import numpy as np import torchvision.transforms as transforms from torchvision.models.detection import fasterrcnn_resnet50_fpn from torchvision.models.detection.faster_rcnn import FastRCNNPredictor
class TrafficLightDetectorNode(Node): def init(self): super().init('traffic_light_detector_node')
def main(args=None): rclpy.init(args=args) traffic_light_detector_node = TrafficLightDetectorNode() rclpy.spin(traffic_light_detector_node) rclpy.shutdown()
if name == 'main': main()