#include <pluginlib/class_loader.h>
#include "point_cloud_base.h"
#include "point_cloud_transformer.h"
#include "point_cloud_transformers.h"
#include "rviz/visualization_manager.h"
#include "rviz/selection/selection_manager.h"
#include "rviz/properties/property.h"
#include "rviz/properties/property_manager.h"
#include "rviz/validate_floats.h"
#include "rviz/frame_manager.h"
#include "rviz/uniform_string_stream.h"
#include <ros/time.h>
#include "rviz/ogre_helpers/point_cloud.h"
#include <tf/transform_listener.h>
#include <OGRE/OgreSceneNode.h>
#include <OGRE/OgreSceneManager.h>
#include <OGRE/OgreWireBoundingBox.h>
Go to the source code of this file.
Classes | |
class | rviz::PointCloudSelectionHandler |
Namespaces | |
namespace | rviz |
Functions | |
bool | rviz::convertPointCloudToPointCloud2 (const sensor_msgs::PointCloud &input, sensor_msgs::PointCloud2 &output) |
void | rviz::deleteProperties (PropertyManager *man, V_PropertyBaseWPtr &props) |
template<typename T > | |
T | rviz::getValue (const T &val) |
Ogre::Vector3 | rviz::pointFromCloud (const sensor_msgs::PointCloud2ConstPtr &cloud, uint32_t index) |