$search
#include "cob_3d_mapping_rviz_plugins/shape_marker.h"#include "cob_3d_mapping_rviz_plugins/polypartition.h"#include "rviz/default_plugin/markers/marker_selection_handler.h"#include "cob_3d_mapping_rviz_plugins/shape_display.h"#include "rviz/visualization_manager.h"#include "rviz/selection/selection_manager.h"#include <OGRE/OgreManualObject.h>#include <OGRE/OgreSceneManager.h>#include <OGRE/OgreSceneNode.h>#include <OGRE/OgreMatrix3.h>#include <pcl/point_types.h>#include <pcl/point_cloud.h>#include <pcl/ros/conversions.h>#include <pcl/common/transform.h>#include <sensor_msgs/PointCloud2.h>
Go to the source code of this file.
Namespaces | |
| namespace | rviz |
Functions | |
| std::string | rviz::createMaterialIfNotExists (const float r, const float g, const float b, const float a) |
| Eigen::Vector3f | rviz::MsgToOrigin (const cob_3d_mapping_msgs::Shape::ConstPtr &new_message) |
| TPPLPoint | rviz::MsgToPoint2D (const pcl::PointXYZ &point, const cob_3d_mapping_msgs::Shape::ConstPtr &new_message) |
| void | rviz::MsgToPoint3D (const TPPLPoint &pt, const cob_3d_mapping_msgs::Shape::ConstPtr &new_message, Eigen::Vector3f &pos, Eigen::Vector3f &normal) |