ros-bridge icon indicating copy to clipboard operation
ros-bridge copied to clipboard

ROS bridge for CARLA Simulator

Results 176 ros-bridge issues
Sort by recently updated
recently updated
newest added

### Problem description When I execute `roslaunch carla_ros_bridge carla_ros_bridge_with_example_ego_vehicle.launch` in a Docker Container with the Rosbridge and ROS noetic installed, many `TF_REPEATED_DATA` warnings appear. Here are the output messages: [example_ego_out.txt](https://github.com/carla-simulator/ros-bridge/files/5739199/example_ego_out.txt)...

bug

When running the carla_ros_bridge on 20.04 with both python2 and python3 installed, `catkin_install_python()` has to be used in order to automatically determine the correct python version for ROS. Otherwise, the...

I have tried Carla 0.9.10 and 0.9.11 with python 3.6 / 3.7 but constantly got the error with exit code -11. here are the output: ``` ... logging to /home/omnisky/.ros/log/2773afaa-8edf-11eb-bf81-0c9d92c5f85e/roslaunch-omnisky-30443.log...

hello, i have the same issue as (Over exposure in carla_manual_control camera feed after 0.9.10.1 update #412) , and as per the instruction above i tried to change the parameter...

It seems there is no package named `carla-ros-bridge` in Ubuntu 20.04 at the moment. After following the steps, apt does not find the package. It also seems like there is...

I am subscribing to the radar point cloud and trying to convert the Radar PointCloud (`sensor_msgs/PointCloud2`) to PCL Pointcloud( `pcl::PointCloud< pcl::PointXYZI>`) using `pcl::fromROSMsg` command but I am losing out the...

Multi Client Support in Carla 0.9.x is incredibly useful feature and writing a ros_bridge for the it is also a huge task and I appreciate the efforts. I believe some...

enhancement

When I run CARLA AD demo,I got this problem as following: WARNING: Version mismatch detected: You are trying to connect to a simulator that might be incompatible with this API...

Currently carla_spectator_camera provides the possibility to spawn an vehicle-attached camera sensor at a specific pose and then modify the pose during runtime. We should move that functionality to carla_ros_bridge and...

I noticed that in the IMU [file](https://github.com/carla-simulator/ros-bridge/blob/d0b714c74128c7d135145559b43e123244ea9b5b/carla_ros_bridge/src/carla_ros_bridge/imu.py#L63-L68), the IMU orientation calculation doesn't seem to be producing values that are in the standard ROS (right-handed ENU) frame. The solution that I...