Skip to content

Commit

Permalink
Remove unnecessary libraries, added visu for learning trajectory
Browse files Browse the repository at this point in the history
  • Loading branch information
RobinSchmid7 committed Sep 1, 2023
1 parent 89746f6 commit 2877f28
Show file tree
Hide file tree
Showing 3 changed files with 121 additions and 113 deletions.
Original file line number Diff line number Diff line change
Expand Up @@ -29,12 +29,7 @@
import torch.nn.functional as F
import torchvision.transforms as transforms
from torchmetrics import ROC
import numpy as np
import cv2
import rospy
import random
from sensor_msgs.msg import Image
from cv_bridge import CvBridge

to_tensor = transforms.ToTensor()

Expand Down Expand Up @@ -109,12 +104,6 @@ def __init__(
# Visualization
self._visualizer = LearningVisualizer()

if self._vis_training_samples:
self._last_image_mask_pub = rospy.Publisher(
f"/wild_visual_navigation_node/last_node_image_mask", Image, queue_size=1
)
self._bridge = CvBridge()

# Lightning module
seed_everything(42)

Expand Down
Loading

0 comments on commit 2877f28

Please sign in to comment.