velodyne | ROS support for Velodyne 3D LIDARs | Robotics library

 by   ros-drivers C++ Version: 2.4.0 License: Non-SPDX

kandi X-RAY | velodyne Summary

kandi X-RAY | velodyne Summary

velodyne is a C++ library typically used in Automation, Robotics applications. velodyne has no bugs, it has no vulnerabilities and it has low support. However velodyne has a Non-SPDX License. You can download it from GitHub.

Velodyne1 is a collection of ROS2 packages supporting Velodyne high definition 3D LIDARs3. The current master branch works with ROS Kinetic and Melodic. CI builds are currently run for Kinetic and Melodic.
Support
    Quality
      Security
        License
          Reuse

            kandi-support Support

              velodyne has a low active ecosystem.
              It has 569 star(s) with 614 fork(s). There are 46 watchers for this library.
              OutlinedDot
              It had no major release in the last 6 months.
              There are 70 open issues and 247 have been closed. On average issues are closed in 388 days. There are 8 open pull requests and 0 closed requests.
              It has a neutral sentiment in the developer community.
              The latest version of velodyne is 2.4.0

            kandi-Quality Quality

              velodyne has 0 bugs and 0 code smells.

            kandi-Security Security

              velodyne has no vulnerabilities reported, and its dependent libraries have no vulnerabilities reported.
              velodyne code analysis shows 0 unresolved vulnerabilities.
              There are 0 security hotspots that need review.

            kandi-License License

              velodyne has a Non-SPDX License.
              Non-SPDX licenses can be open source with a non SPDX compliant license, or non open source licenses, and you need to review them closely before use.

            kandi-Reuse Reuse

              velodyne releases are not available. You will need to build from source code and install.
              Installation instructions are not available. Examples and code snippets are available.
              It has 4647 lines of code, 2 functions and 14 files.
              It has low code complexity. Code complexity directly impacts maintainability of the code.

            Top functions reviewed by kandi - BETA

            kandi's functional review helps you automatically verify the functionalities of the libraries and avoid rework.
            Currently covering the most popular Java, JavaScript and Python libraries. See a Sample of velodyne
            Get all kandi verified functions for this library.

            velodyne Key Features

            No Key Features are available at this moment for velodyne.

            velodyne Examples and Code Snippets

            No Code Snippets are available at this moment for velodyne.

            Community Discussions

            QUESTION

            Add distance field : [x,y,z,distance] from VLP-16 using ROS or velodyne driver
            Asked 2021-Sep-24 at 17:16

            Velodyne lidars publish PointCloud2 messages with the fields containing :

            • x, type : float32
            • y, type : float32
            • z, type : float32
            • intensity, type : float32
            • ring, type : uint16
            • time, type : float32

            However, I need to add distance field(output points with distance) because I needed this field as a research purpose.

            Is it possible to write a node or adapt the velodyne driver to output points with that field? If so, could you possibly tell me how to achieve that?

            Any help is much appreciated. Thanks:)

            ...

            ANSWER

            Answered 2021-Sep-24 at 17:16

            The best solution is not to change the velodyne driver, but since you're using ros, to leverage all the ecosystem tools built in. For example, the velodyne publishes a sensor_msgs/PointCloud2 topic. Then internally, using C++, ROS treats any PointCloud2 msg into any PCL pointcloud type. If you're doing serious processing of pointclouds, don't re-invent the wheel (but worse), try solving the problem with tools from PCL. Use it's pre-built filters (ex ground plane filter) and prebuilt segmentation tools (ex could Euclidean Cluster Extraction solve your problem?). Additionally, some of these PCL tools are pre-wrapped in ros, to use from the launch file if you want!

            Otherwise you could use PCL to add a distance parameter, by choosing the pointcloud type in ros as of type pcl::PointWithRange or pcl::PointWithViewpoint. I don't think it'll autocompute that variable, but you can iterate through the points and compute it yourself, and the memory for it will already be allocated and localized.

            Source https://stackoverflow.com/questions/69277564

            QUESTION

            Correct tf frames setting in ndt_matching
            Asked 2021-Jul-21 at 03:30

            ndt_matching succeeded in autoware, but the vehicle model cannot be set correctly.

            1. How do I set the correct angle for the vehicle model?
            2. What does the frame "mobility" mean?

            tf.launch

            ...

            ANSWER

            Answered 2021-Jul-21 at 03:30

            The settings in the TF file were correct. To change the angle of the vehicle model, I made the following settings.

            1. Change the yaw setting of Baselink to Localizer in the Setup tab (in the direction you want the vehicle model to point).
            2. Set the yaw setting of ndt_matching to offset it.(if baselink angle(1) is -1.55, here it is +1.55)

            I wrote an article about these issues, Thank you JWCS!

            https://medium.com/yodayoda/localization-with-autoware-3e745f1dfe5d

            Source https://stackoverflow.com/questions/68257668

            QUESTION

            Why is RVIZ telling me that there is "No transfrom from [velodyne] to [base_link]" even though I have such a joint defined in my URDF?
            Asked 2021-Jun-02 at 21:09

            RVIZ is telling me that there is "No transfrom from [velodyne] to [base_link]". I have a joint between these two objects defined in my URDF file:

            ...

            ANSWER

            Answered 2021-Jun-02 at 21:09

            You will need to launch a robot_state_publisher node that publishes the tf transforms between your different links in any case - even if your links are connected with fixed joints only. Therefore either add

            Source https://stackoverflow.com/questions/67756243

            QUESTION

            How do I get the orientation from a open3d.geometry.OrientedBoundingBox?
            Asked 2021-Mar-21 at 20:50

            I've created a Oriented Bounding Box from a clustered sub point cloud of a Velodyne Lidar (rotating laser sensor). I want to get the orientation of the Bounding Box (preferable as a quaternion).

            ...

            ANSWER

            Answered 2021-Mar-21 at 20:50

            Looking at the link you shared, I see the OBB object has the following properties: center, extent and R. If you can access them then you can get position and orientation. Center is a point (x,y,z), extent are three lengths in x, y and z direction and R is a rotation matrix. Columns of R are three orthogonal unit-vectors pointing on rotated x, y and z directions.

            I think you are interested in orientation, so R is the orientation matrix. You can convert it to quaternion using the matrix-to-quaternion method on this page: https://www.euclideanspace.com/maths/geometry/rotations/conversions/matrixToQuaternion/

            Source https://stackoverflow.com/questions/66712854

            QUESTION

            Reading Point Cloud .bin file using C++
            Asked 2021-Jan-05 at 00:13

            I'm trying to read .bin point cloud files. I found this link suggesting a python code that I can convert to C++. I came up with the following code, but the precision of the floating point numbers are different compared to the results that I got from running the python code in the above link. I noticed that some coordinate values in the middle are totally missing, or in other words, the count of the floating point values that resulted from python is more than that of the C++ code:

            ...

            ANSWER

            Answered 2021-Jan-05 at 00:13

            Here's a code that produces exactly the same output as the Python version:

            Source https://stackoverflow.com/questions/65570879

            QUESTION

            how to display velodyne points on ROS installed on "Ubuntu on Mac" via Parallels Desktop on macOS?
            Asked 2020-Jun-23 at 20:51

            This is probably easy but I am a noob in networks so please help! Basically I am trying to display lidar points from my Velodyne VLP-16 on ROS installed on Ubuntu 18.04 which is in turn installed via Parallels Desktop on my macOS.

            So I plugged the velodyne's ethernet cable to my MacBook via a usb-C-to-ethernet adapter and set this on my mac:

            I can type in my browser this address 192.168.1.201 and I can see the velodyne interface. So it works.

            When I now go to "Ubuntu on Mac" via Parallels Desktop and do not change anything in Network->Settings->Wired->Connected so I can see these settings:

            ... I can still see the velodyne interface via a browser on Ubuntu by typing the 192.168.1.201 address as I can on macOS. The only problem is that when I wanna run

            ...

            ANSWER

            Answered 2020-Jun-23 at 20:51

            After a thorough examination of the network traffic both on macOS and on the emulated Ubuntu using Wireshark on both ends, I realised that there is no Network adapter present in the virtual machine configuration.

            Following the answer from Desktop Parallel support, I did: Ubuntu on Mac -> configure -> hardware -> add device -> network 2 -> source: USB...

            and when you check now in Wireshark, you will see the traffic coming from the USB adapter and the ROS driver, via an adequate port, will capture the packets.

            Source https://stackoverflow.com/questions/62525243

            QUESTION

            How to keep NVCC from generating compatibility for other 11 SM architectures?
            Asked 2020-Feb-03 at 06:11

            When I build PCL library on Jetson TX2 from source via CMAKE, I get the following debug logs among other msgs:

            ...

            ANSWER

            Answered 2020-Feb-03 at 06:11

            I found a file which was causing the CMAKE to include 10 sm_arch in compatibility list. Here's the link. I will re-compile after editing the file for just 1 sm_arch and compare the size of binaries generated. – Anuj Patil Jan 22 at 18:10

            So findCUDA was the culprit here. Editing the files to required sm_arch does the trick!

            Source https://stackoverflow.com/questions/59863431

            Community Discussions, Code Snippets contain sources that include Stack Exchange Network

            Vulnerabilities

            No vulnerabilities reported

            Install velodyne

            You can download it from GitHub.

            Support

            For any new features, suggestions and bugs create an issue on GitHub. If you have any questions check and ask questions on community page Stack Overflow .
            Find more information at:

            Find, review, and download reusable Libraries, Code Snippets, Cloud APIs from over 650 million Knowledge Items

            Find more libraries
            CLONE
          • HTTPS

            https://github.com/ros-drivers/velodyne.git

          • CLI

            gh repo clone ros-drivers/velodyne

          • sshUrl

            git@github.com:ros-drivers/velodyne.git

          • Stay Updated

            Subscribe to our newsletter for trending solutions and developer bootcamps

            Agree to Sign up and Terms & Conditions

            Share this Page

            share link

            Explore Related Topics

            Consider Popular Robotics Libraries

            openpilot

            by commaai

            apollo

            by ApolloAuto

            PythonRobotics

            by AtsushiSakai

            carla

            by carla-simulator

            ardupilot

            by ArduPilot

            Try Top Libraries by ros-drivers

            rosserial

            by ros-driversC++

            usb_cam

            by ros-driversC++

            video_stream_opencv

            by ros-driversC++

            joystick_drivers

            by ros-driversPython

            pointgrey_camera_driver

            by ros-driversC++