[ros-users] pointcloud to pointcloud2 conversion
Martin, L
kollaps2001 at hotmail.com
Tue Oct 19 14:31:31 UTC 2010
rusu wrote:
>
> Martin,
>
> What you are doing seems to be correct, but:
>
> * did you include the correct header file?
> * do you have a correct pcl dependency in your manifest.xml?
>
> Cheers,
> Radu.
>
>
Hi,
yeah I think I include the correct header files:
#include "ros/ros.h"
#include "sensor_msgs/PointCloud.h"
#include "sensor_msgs/PointCloud2.h"
#include "message_filters/subscriber.h"
#include "pcl/io/pcd_io.h"
#include "pcl/point_types.h"
and dependencies"
<depend package="roscpp"/>
<depend package="ptu_46"/>
<depend package="pcl"/>
<depend package="pcl_ros"/>
<depend package="geometry_msgs"/>
<depend package="sensor_msgs"/>
or am I missing something?
--
View this message in context: http://ros-users.122217.n3.nabble.com/pointcloud-to-pointcloud2-conversion-tp1729261p1732573.html
Sent from the ROS-Users mailing list archive at Nabble.com.
More information about the ros-users
mailing list