#include <ros/ros.h>#include <boost/thread/mutex.hpp>#include <pcl/io/io.h>#include <pcl/io/pcd_io.h>#include <pcl/point_types.h>#include <pcl_visualization/pcl_visualizer.h>#include <terminal_tools/print.h>#include <terminal_tools/parse.h>#include <vector>#include <string>#include <string.h>#include <stdlib.h>#include <boost/config.hpp>#include <boost/mpl/bool.hpp>#include <boost/algorithm/string/yes_no_type.hpp>#include <list>#include <boost/algorithm/string/sequence_traits.hpp>#include <boost/algorithm/string/config.hpp>#include <boost/range/begin.hpp>#include <boost/range/end.hpp>#include <boost/range/const_iterator.hpp>#include <boost/range/as_literal.hpp>#include <boost/range/iterator_range.hpp>#include <boost/detail/iterator.hpp>#include <boost/algorithm/string/classification.hpp>#include <locale>#include <algorithm>#include <boost/iterator/transform_iterator.hpp>#include <boost/range/value_type.hpp>#include <functional>#include <boost/range/iterator.hpp>#include <boost/algorithm/string/compare.hpp>#include <boost/algorithm/string/finder.hpp>#include <boost/algorithm/string/constants.hpp>#include <iterator>#include <boost/algorithm/string/find.hpp>#include <boost/algorithm/string/split.hpp>#include <boost/mpl/logical.hpp>#include <deque>#include <boost/algorithm/string/concept.hpp>#include <boost/algorithm/string/detail/sequence.hpp>#include <boost/algorithm/string/detail/find_format_store.hpp>#include <boost/algorithm/string/detail/replace_storage.hpp>#include <boost/algorithm/string/detail/util.hpp>#include <boost/algorithm/string/find_format.hpp>#include <boost/algorithm/string/formatter.hpp>#include <boost/algorithm/string/find_iterator.hpp>

Go to the source code of this file.
Typedefs | |
| typedef pcl_visualization::PointCloudColorHandler < sensor_msgs::PointCloud2 > | ColorHandler |
| typedef ColorHandler::ConstPtr | ColorHandlerConstPtr |
| typedef ColorHandler::Ptr | ColorHandlerPtr |
| typedef pcl::PointXYZ | Point |
Functions | |
| void | cloud_cb (const sensor_msgs::PointCloud2ConstPtr &cloud) |
| int | main (int argc, char **argv) |
Variables | |
| sensor_msgs::PointCloud2ConstPtr | cloud_ |
| sensor_msgs::PointCloud2ConstPtr | cloud_old_ |
| boost::mutex | m |
| typedef pcl_visualization::PointCloudColorHandler<sensor_msgs::PointCloud2> ColorHandler |
Definition at line 55 of file pointcloud_online_viewer.cpp.
| typedef ColorHandler::ConstPtr ColorHandlerConstPtr |
Definition at line 57 of file pointcloud_online_viewer.cpp.
| typedef ColorHandler::Ptr ColorHandlerPtr |
Definition at line 56 of file pointcloud_online_viewer.cpp.
| typedef pcl::PointXYZ Point |
Definition at line 54 of file pointcloud_online_viewer.cpp.
| void cloud_cb | ( | const sensor_msgs::PointCloud2ConstPtr & | cloud | ) |
Definition at line 63 of file pointcloud_online_viewer.cpp.
| int main | ( | int | argc, | |
| char ** | argv | |||
| ) |
Definition at line 73 of file pointcloud_online_viewer.cpp.
| sensor_msgs::PointCloud2ConstPtr cloud_ |
Definition at line 59 of file pointcloud_online_viewer.cpp.
| sensor_msgs::PointCloud2ConstPtr cloud_old_ |
Definition at line 59 of file pointcloud_online_viewer.cpp.
| boost::mutex m |
Definition at line 60 of file pointcloud_online_viewer.cpp.