Top "Ros" questions

ROS (Robot Operating System) provides libraries and tools to help software developers create robotics applications.

How to convert a cv::Mat into a sensor_msgs in ros?

I am trying to convert a cv::Mat into a sensor_msgs so that I can publish this in ROS. …

c++ pointers opencv type-conversion ros
ModuleNotFoundError: No module named 'rospkg'

I am new to ROS, I have a problem when I import rospy into my script file example.py and …

python ros rospy cmakelists-options
How can I import PCL into Python, on Ubuntu?

So my situation is as follows: I am on an Ubuntu 14.04, and I am very simply, trying to use PCL (…

python point-cloud-library ros
how to effeciently convert ROS PointCloud2 to pcl point cloud and visualize it in python

I'm trying to do some segmentation on a pointcloud from a kinect one in ROS. As of now i have …

python kinect ros point-clouds
How to get ROS xml param from launch file using Python

I have a launch file which extension is xml, and I would like to get the value of a parameter. …

python xml ros ar.drone
Linking opencv nonfree components (SIFT features and OCL specifically)

I am having trouble compiling some code after a OS upgrade (Ubuntu 12.04 to 14.04) and a re-install of opencv. The general …

opencv dynamic-linking sift ros ocl
ROS Installation error ( ROS Kinetic in Ubuntu 16.04 )

The sequence of steps listed in http://wiki.ros.org/kinetic/Installat... have been followed. (Trying to install ROS kinetic …

ubuntu-16.04 ros
Multithreading behaviour with ROS AsyncSpinner

I am trying to understand how the AsyncSpinner from ROS really works because I may have something misunderstood. You can …

c++ multithreading callback ros
Setting up ROS package in CLion

I am using CLion (C++ IDE) for editing a ROS package. I was able to open a package by opening …

c++ cmake ros clion catkin
Installing ROS Melodic on Ubuntu 18.10

I can't be the only person interested in this combination of Cosmic (with Wayland) and Melodic. I'll be up-front: I …

boost ros