[ros-users] Problems with boost and sensor_msgs

Josh Faust jfaust at willowgarage.com
Sat Dec 18 05:49:32 UTC 2010


You likely have a conflicting #define in one of your headers.

On Fri, Dec 17, 2010 at 9:11 PM, panj <panjia1983 at gmail.com> wrote:

>
> solved....Must include #include <pcl_ros/io/bag_io.h>
> #include <pcl/point_types.h>
> or
> #include <rosbag/bag.h>
> #include <rosbag/chunked_file.h>
> #include <rosbag/view.h>
> #include <sensor_msgs/point_cloud_conversion.h>
> #include <boost/foreach.hpp>
> #include <sensor_msgs/PointCloud2.h>
> before headers of my own...Weird...
>
> --
> View this message in context:
> http://ros-users.122217.n3.nabble.com/Problems-with-boost-and-sensor-msgs-tp2108524p2109123.html
> Sent from the ROS-Users mailing list archive at Nabble.com.
> _______________________________________________
> ros-users mailing list
> ros-users at code.ros.org
> https://code.ros.org/mailman/listinfo/ros-users
>
-------------- next part --------------
An HTML attachment was scrubbed...
URL: <http://lists.ros.org/pipermail/ros-users/attachments/20101217/bd6e3cad/attachment-0003.html>


More information about the ros-users mailing list