#include <mapviz_plugins/pointcloud2_plugin.h>#include <cmath>#include <cstdio>#include <algorithm>#include <vector>#include <map>#include <boost/algorithm/string.hpp>#include <QColorDialog>#include <QDialog>#include <QGLWidget>#include "ui_topic_select.h"#include <ros/master.h>#include <swri_transform_util/transform.h>#include <swri_yaml_util/yaml_util.h>#include <mapviz/select_topic_dialog.h>#include <pluginlib/class_list_macros.h>
Go to the source code of this file.
Namespaces | |
| namespace | mapviz_plugins |
Functions | |
| int32_t | mapviz_plugins::findChannelIndex (const sensor_msgs::PointCloud2ConstPtr &cloud, const std::string &channel) |