pax_global_header00006660000000000000000000000064125601472410014514gustar00rootroot0000000000000052 comment=008a121c59e0cb462c5d87160ffd436ed5831290 ros-pcl-msgs-0.2.0/000077500000000000000000000000001256014724100140415ustar00rootroot00000000000000ros-pcl-msgs-0.2.0/CHANGELOG.rst000066400000000000000000000014141256014724100160620ustar00rootroot00000000000000^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^ Changelog for package pcl_msgs ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^ 0.2.0 (2014-04-09) ------------------ * clean up package.xml * update maintainer info * remove eigen dependency * Merge pull request `#1 `_ from bulwahn/patch-1 * Contributors: Lukas Bulwahn, Paul Bovbel 0.1.0 (2013-07-09) ------------------ * Generate messages into the pcl_msgs namespace rather than the pcl namespace 0.0.3 (2012-12-15) ------------------ * fix deps for messages * Updated for new catkin<...> rule 0.0.2 (2012-11-26 18:50) ------------------------ * increasing version * ros message generation prefix hack 0.0.1 (2012-11-26 17:48) ------------------------ * initial commit - pcl ROS messages ros-pcl-msgs-0.2.0/CMakeLists.txt000066400000000000000000000007601256014724100166040ustar00rootroot00000000000000cmake_minimum_required(VERSION 2.8.3) project(pcl_msgs) # Deal with catkin find_package(catkin REQUIRED COMPONENTS message_generation sensor_msgs std_msgs) # create messages add_message_files(DIRECTORY msg FILES ModelCoefficients.msg PointIndices.msg PolygonMesh.msg Vertices.msg ) generate_messages(DEPENDENCIES sensor_msgs std_msgs) catkin_package(CATKIN_DEPENDS message_runtime sensor_msgs std_msgs) ros-pcl-msgs-0.2.0/README.md000066400000000000000000000001001256014724100153070ustar00rootroot00000000000000pcl_msgs ======== ROS package containing PCL-related messages ros-pcl-msgs-0.2.0/msg/000077500000000000000000000000001256014724100146275ustar00rootroot00000000000000ros-pcl-msgs-0.2.0/msg/ModelCoefficients.msg000066400000000000000000000000401256014724100207130ustar00rootroot00000000000000Header header float32[] values ros-pcl-msgs-0.2.0/msg/PointIndices.msg000066400000000000000000000000371256014724100177270ustar00rootroot00000000000000Header header int32[] indices ros-pcl-msgs-0.2.0/msg/PolygonMesh.msg000066400000000000000000000002471256014724100176060ustar00rootroot00000000000000# Separate header for the polygonal surface Header header # Vertices of the mesh as a point cloud sensor_msgs/PointCloud2 cloud # List of polygons Vertices[] polygons ros-pcl-msgs-0.2.0/msg/Vertices.msg000066400000000000000000000000521256014724100171200ustar00rootroot00000000000000# List of point indices uint32[] vertices ros-pcl-msgs-0.2.0/package.xml000066400000000000000000000017731256014724100161660ustar00rootroot00000000000000 pcl_msgs 0.2.0 Package containing PCL (Point Cloud Library)-related ROS messages. Open Perception Julius Kammerl William Woodall Paul Bovbel Bill Morris BSD http://wiki.ros.org/pcl_msgs https://github.com/ros-perception/pcl_msgs https://github.com/ros-perception/pcl_msgs/issues catkin message_generation sensor_msgs std_msgs message_runtime sensor_msgs std_msgs