Formula-Student-Driverless-Simulator
Formula-Student-Driverless-Simulator copied to clipboard
A virtual world where Autonomous Systems from different Formula Student teams can compete in time-trial challenges
Apparently raycasting simulations can do 600,000 points per second. This simulator can only do 100,000 points per second. Does anyone have an idea on how we can improve lidar performance?...
This pull request will try to implement loading of text files and loading this into the unreal engine environment without having to need Unreal engine. This will allow us to...
Would be nice to be able to just clone the ros bridge part into someone's current workspace. It seems to me that the only issues is the AirSim dependencies, so...
Here is the error logs: In file included from /opt/ros/humble/include/rclcpp/rclcpp/wait_set.hpp:25, from /opt/ros/humble/include/rclcpp/rclcpp/rclcpp.hpp:168, from /home/chentairan/Formula-Student-Driverless-Simulator/ros2/src/fsds_ros2_bridge/include/airsim_ros_wrapper.h:1, from /home/chentairan/Formula-Student-Driverless-Simulator/ros2/src/fsds_ros2_bridge/src/airsim_ros_wrapper.cpp:1: /opt/ros/humble/include/rclcpp/rclcpp/wait_set_policies/dynamic_storage.hpp:226:7: note: candidate: ‘rclcpp::wait_set_policies::DynamicStorage::storage_has_entity(const rclcpp::ServiceBase&, const std::vector&)::’ 226 | [&entity](const auto & inner) {return...
Hi, I face an issue when connecting the simulation to the autonomous software of our car. The velocity (fsds/gss) matches the velocity estimated by our SLAM. but there is a...
Hi, Is it possible to provide camera calibration info to the simulator similar to what is here (http://docs.ros.org/en/melodic/api/sensor_msgs/html/msg/CameraInfo.html)? If yes, is it also possible to extract it?
Hello, I am trying to run this simulator on Win10 using the Python Client. Following the getting started guide I managed to obtain a driveable car running from release binaries...
Hi, we're using an old version of FSDS on Uneral 4.25.4 and it works great. I tried to git clone the latest version but Unreal asks me to rebuild blocks...
It would be very nice for visualization purposes to have a URDF model of the default race car. Does anyone have that?
At the moment there are too few python examples of working with camera's. It would be great to have some more examples. I am thinking of the following examples, but...