How can I convert image array data to PointCloud2?
I have special image array data and I want convert it to PointCloud2. But I can't understand meaning of PointCloud2's parameter, so I can't do converting. Every pixel of Image array data have straight...
View Articlelaserscan to pointcloud timestamp issue
Dear all, I want to convert laserscans (sick lms511) to pointcloud2. I have found a topic on how to perform this conversion here :...
View ArticleProviding PointCloud2 data from ZED camera
I am trying to run a program that requires PointCloud2 data using only the ZED camera, no LASER. Depthcloud to Laserscan is said to work well with ZED, so could I combine this with the Laserscan to...
View ArticleAccessing values while iterating points in sensor_msgs::PointCloud2 from...
I am writing a node that subscribes to a topic of type `sensor_msgs::PointCloud2`. In the callback I want to iterate the points in the point cloud using `sensor_msgs::PointCloud2ConstIterator`. This is...
View ArticleCutting off a pointcloud2 at a certain range
I am working on a mapping problem with a laser scanner. I want to cut off the 20% of points that are furthest away from the robot. So this distance should be variable for each time steps. Depending on...
View ArticlePointCloud2 read_points unpack_from problem
Hey, I'm working on a object recognition framework that uses deep learning methods. Given the locations of the objects in the image (bounding box), I use the PointCloud publised by a Kinect 2, to...
View Articlekinect2 dont take all point clouds
Hi everyone my kinect 2 does not save the entire point cloud that is displayed in the rviz or in the viewer, ignores surfaces and some elements(walls, objects, ground, etc) the strange thing is that in...
View Articlepointcloud2 and path planning
currently running ubuntu 16.04, ros kinetic, using gazebo 7 simulation with a sawyer (intera 5.2), running kinect camera. I want to take a point from a point cloud (type `PointCloud2`) taken from the...
View Articlepointcloud2 transform c++/python
running kinetic, ubuntu 16.04, gazebo 7, sawyer simulator with intera 5.2, kinect/openni camera warning: i am very new to ROS, C++ and Python. trying to transform a point cloud (type `PointCloud2`,...
View Article"right_arm_base_link" passed to lookupTransform argument target_frame does...
ros kinetic, ubuntu 16.04, gazebo 7, intera 5.2 (for sawyer robot), kinect camera in simulation. trying to transform pointcloud from kinect frame to base from of a sawyer robot. i've coded for this...
View ArticlePublish pointCloud2 from csv files for LOAM
Hi everyone, I have laser scans in the form of .csv files. I want to read these .csv files and publish the scans as Pointcloud2 messages, so that I can feed them to LOAM for registration. Currently, I...
View ArticleCan't display occupied voxels octomap using pointcloud2
Fairly new to this so let me know if there's a better way of doing things! I'm attempting dynamic collision avoidance with a Kinect V1 and the ur5 moveit package on ROS kinetic. The PC is running...
View ArticleOrder of point clouds to use while merging (ICP)
My team and I have built the following setup (view from above). It's a 3x3x3m aluminum grid with 4 Kinects placed at height 2.1~2.2m and are facing downwards (at 20~30 degrees). The angle between the...
View ArticleHow to save OctoMap data everytime?
Hi, I'm getting a 3D map using the OctoMap server package. But As the vehicle moves in this mapping, the map updates itself to the exact location where the vehicle is moving. What I want to do is not...
View ArticleMoveit Octomap Not Allowing Command Planning or Execution
Hi all, I've been trying to hook up Moveit so that my robot can avoid obstacles using openni_tracker and openni_launch. I've added octomap capabilities to my demo.launch file as: My process for getting...
View ArticleColoring of pcd-pointcloud in Rviz
Hi! I am very new to ROS, so please take that into account when answering :) (Ubuntu 14.04 64bit in a VirtualBox with Windows Host, ROS Indigo) **What I did:** I used rosrun pcl_ros pcd_to_pointcloud...
View ArticleRtabmap PointCloud2 frame oscillates when viewed in RVIZ
The PointCloud2 topic's frame keeps switching back and forth wrt to the robot's frame, as seen in https://imgur.com/a/NosBsOx. What could be the cause?
View ArticleWhy cannot launch node of type [laser_geometry/laser_geometry]
I need to transfer from `sensor_msgs::LaserScan` to `sensor_msgs::PointCloud2`. I found laser_geometry package, (http://wiki.ros.org/laser_geometry). Because there is no ROS API, I found a link which...
View ArticleUnderstand PointCloud2 msg (data array)
Hi everyone, I used rostopic echo and received a bunch of PointCloud2 Msg, but I have a hard time understand it especially for the "data" array. Here is one example: header: seq: 0 stamp: secs:...
View ArticleROS2: topic subscribed but not received
I have a device driver that publishes a Pointcloud2 message at 30 Hz. I can subscribe the message in Rviz and I can see the correct pointcloud. When I move the camera in 3D view the pointcloud...
View Article