$search
#include <pluginlib/class_list_macros.h>
#include <sensor_msgs/PointCloud2.h>
#include <message_filters/subscriber.h>
#include <nodelet_topic_tools/nodelet_mux.h>
#include <nodelet_topic_tools/nodelet_demux.h>
Go to the source code of this file.
Typedefs | |
typedef nodelet::NodeletDEMUX < sensor_msgs::PointCloud2 > | NodeletDEMUX |
typedef nodelet::NodeletMUX < sensor_msgs::PointCloud2, message_filters::Subscriber < sensor_msgs::PointCloud2 > > | NodeletMUX |
Functions | |
PLUGINLIB_DECLARE_CLASS (pcl, NodeletDEMUX, NodeletDEMUX, nodelet::Nodelet) | |
PLUGINLIB_DECLARE_CLASS (pcl, NodeletMUX, NodeletMUX, nodelet::Nodelet) |
PLUGINLIB_DECLARE_CLASS | ( | pcl | , | |
NodeletDEMUX | , | |||
NodeletDEMUX | , | |||
nodelet::Nodelet | ||||
) |
PLUGINLIB_DECLARE_CLASS | ( | pcl | , | |
NodeletMUX | , | |||
NodeletMUX | , | |||
nodelet::Nodelet | ||||
) |