point cloud

Autonomous navigation of two wheels differential drive robot in Gazebo

Two wheels differential drive robot (with two caster wheels). List of installed sensors: • Velodyne VLP-16. • Velodyne HDL-32E. • Hokuyo Laser scanner. • IMU. • Microsoft Kinect/Asus Xtion Pro. • RGB Camera. You can manually control the robot with Joystick controller for mapping robot environment. Autonomous navigation is possible by setting goal pose.  

Autonomous navigation of two wheels differential drive robot in Gazebo Read More »

Converting sensor_msgs::PCLPointCloud2 to sensor_msgs::PointCloud and reverse

 

Converting sensor_msgs::PCLPointCloud2 to sensor_msgs::PointCloud and reverse Read More »

Converting pcl::PCLPointCloud2 to pcl::PointCloud and reverse

 

  more about pcl point cloud and conversion

Converting pcl::PCLPointCloud2 to pcl::PointCloud and reverse Read More »

Assembling Laser scans into PCL point cloud Using Gazebo and ROS

For this work, first I loaded the RRBot in Gazebo and launched Its joints controller, then I sent a periodic signal to the robot such that the laser scanner mounted on the robot swings. In the following, I assembled the incoming laser scans with the transformation from tf and created PCL point cloud. Install the necessary

Assembling Laser scans into PCL point cloud Using Gazebo and ROS Read More »

Real-time object recognition and 6DOF pose estimation based on Linemod algorithm with ROS and PCL pointcloud

In this tutorial, I’m gonna show you how to do object recognition and 6DOF pose estimation in real-time based on Linemod algorithm with ROS and PCL pointcloud. First, you need to install ork:

Then add the model of your object for tracking to Couch DB:

You need to install Kinect driver, if you don’t

Real-time object recognition and 6DOF pose estimation based on Linemod algorithm with ROS and PCL pointcloud Read More »

How to find CMake from arbitrary installed locations

In my other tutorial, I showed you how to install your code in an arbitrary location in Unix/ Linux systems. In this tutorial, I’m gonna show you how to find them after installation. Here I have two examples: OpenCV, PCL point cloud I can assume that you have compiled and installed them using the following command:

1)PCL

How to find CMake from arbitrary installed locations Read More »

Converting a PCL pointcloud to a ROS pcl message/ ROS pcl message to PCL point cloud

The relation between ROS and PCL point cloud is a little bit complicated, at first, it was part of ROS, then it became a separate project and whole the time you need some serializer and deserializer to send and receive point cloud ROS messages. There are some old deprecated ways to do that and they

Converting a PCL pointcloud to a ROS pcl message/ ROS pcl message to PCL point cloud Read More »