Skip to content

Commit

Permalink
feat(#78): removed carla API from sensor_filter_debug.py
Browse files Browse the repository at this point in the history
  • Loading branch information
robertik10 committed Dec 3, 2023
1 parent 8dcf9f7 commit 2d7a574
Showing 1 changed file with 9 additions and 9 deletions.
18 changes: 9 additions & 9 deletions code/perception/src/sensor_filter_debug.py
Original file line number Diff line number Diff line change
Expand Up @@ -15,9 +15,8 @@
from tf.transformations import euler_from_quaternion
from std_msgs.msg import Float32MultiArray
from xml.etree import ElementTree as eTree

import carla
import rospy
# import carl____a remove ___ to use
# import rospy
# from carla_msgs.msg import CarlaLo

GPS_RUNNING_AVG_ARGS: int = 10
Expand Down Expand Up @@ -49,18 +48,19 @@ def __init__(self):
# todo: automatically detect town
self.transformer = None

# remove comments to use carla
# Carla API hero car position
# Get parameters from the launch file
host = rospy.get_param('~host', 'carla-simulator')
port = rospy.get_param('~port', 2000)
timeout = rospy.get_param('~timeout', 100.0)
# host = rospy.get_param('~host', 'carla-simulator')
# port = rospy.get_param('~port', 2000)
# timeout = rospy.get_param('~timeout', 100.0)

# Connect to the CARLA server
client = carla.Client(host, port)
client.set_timeout(timeout)
# client = carl___a.Client(host, port)
# client.set_timeout(timeout)

# Get the world
self.world = client.get_world()
# self.world = client.get_world()

# Get the ego vehicle
self.vehicle = None
Expand Down

0 comments on commit 2d7a574

Please sign in to comment.