$search
#include <boost/thread.hpp>
#include <pluginlib/class_list_macros.h>
#include <pcl/point_types.h>
#include <sensor_msgs/PointCloud2.h>
#include <pcl_ros/pcl_nodelet.h>
Go to the source code of this file.
Classes | |
class | pcl_ros::TestListener |
class | pcl_ros::TestPingPong |
class | pcl_ros::TestTalker |
Namespaces | |
namespace | pcl_ros |
Typedefs | |
typedef pcl_ros::TestListener | TestListener |
typedef pcl_ros::TestPingPong | TestPingPong |
typedef pcl_ros::TestTalker | TestTalker |
Functions | |
PLUGINLIB_DECLARE_CLASS (pcl, TestPingPong, TestPingPong, nodelet::Nodelet) | |
PLUGINLIB_DECLARE_CLASS (pcl, TestListener, TestListener, nodelet::Nodelet) | |
PLUGINLIB_DECLARE_CLASS (pcl, TestTalker, TestTalker, nodelet::Nodelet) |
typedef pcl_ros::TestListener TestListener |
Definition at line 192 of file test_passing.cpp.
typedef pcl_ros::TestPingPong TestPingPong |
Definition at line 193 of file test_passing.cpp.
typedef pcl_ros::TestTalker TestTalker |
Definition at line 191 of file test_passing.cpp.
PLUGINLIB_DECLARE_CLASS | ( | pcl | , | |
TestPingPong | , | |||
TestPingPong | , | |||
nodelet::Nodelet | ||||
) |
PLUGINLIB_DECLARE_CLASS | ( | pcl | , | |
TestListener | , | |||
TestListener | , | |||
nodelet::Nodelet | ||||
) |
PLUGINLIB_DECLARE_CLASS | ( | pcl | , | |
TestTalker | , | |||
TestTalker | , | |||
nodelet::Nodelet | ||||
) |