00001 #include <pluginlib/class_list_macros.h>
00002 #include <message_transport/raw_publisher.h>
00003 #include <message_transport/raw_subscriber.h>
00004 #include <sharedmem_transport/sharedmem_publisher.h>
00005 #include <sharedmem_transport/sharedmem_subscriber.h>
00006 #include <udpmulti_transport/udpmulti_publisher.h>
00007 #include <udpmulti_transport/udpmulti_subscriber.h>
00008 #include <pointcloud_transport_base/decimated_publisher.h>
00009 #include <pointcloud_transport_base/decimated_subscriber.h>
00010 #include <sensor_msgs/PointCloud.h>
00011
00012
00013 PLUGINLIB_REGISTER_CLASS(raw_pub, message_transport::RawPublisher<sensor_msgs::PointCloud>, message_transport::PublisherPlugin<sensor_msgs::PointCloud>)
00014 PLUGINLIB_REGISTER_CLASS(raw_sub, message_transport::RawSubscriber<sensor_msgs::PointCloud>, message_transport::SubscriberPlugin<sensor_msgs::PointCloud>)
00015
00016
00017 PLUGINLIB_REGISTER_CLASS(sharedmem_pub, sharedmem_transport::SharedmemPublisher<sensor_msgs::PointCloud>, message_transport::PublisherPlugin<sensor_msgs::PointCloud>)
00018 PLUGINLIB_REGISTER_CLASS(sharedmem_sub, sharedmem_transport::SharedmemSubscriber<sensor_msgs::PointCloud>, message_transport::SubscriberPlugin<sensor_msgs::PointCloud>)
00019
00020
00021 PLUGINLIB_REGISTER_CLASS(decimated_pub, decimated_transport::DecimatedPublisher, message_transport::PublisherPlugin<sensor_msgs::PointCloud>)
00022 PLUGINLIB_REGISTER_CLASS(decimated_sub, decimated_transport::DecimatedSubscriber, message_transport::SubscriberPlugin<sensor_msgs::PointCloud>)
00023
00024
00025 PLUGINLIB_REGISTER_CLASS(udpmulti_pub, udpmulti_transport::UDPMultiPublisher<sensor_msgs::PointCloud>, message_transport::PublisherPlugin<sensor_msgs::PointCloud>)
00026 PLUGINLIB_REGISTER_CLASS(udpmulti_sub, udpmulti_transport::UDPMultiSubscriber<sensor_msgs::PointCloud>, message_transport::SubscriberPlugin<sensor_msgs::PointCloud>)
00027