Namespaces | |
namespace | status_levels |
Classes | |
class | ArrowMarker |
class | Axes |
An object that displays a set of X/Y/Z axes, with X=Red, Y=Green, Z=Blue. More... | |
class | AxesDisplay |
Displays a set of XYZ axes at the origin. More... | |
class | AxisColorPCTransformer |
class | BillboardLine |
An object that displays a multi-segment line strip rendered as billboards. More... | |
class | BoolProperty |
class | CameraBase |
Generic interface for a camera. More... | |
class | CameraDisplay |
class | CategoryProperty |
struct | Color |
class | ColorEditor |
class | ColorItem |
class | ColorProperty |
class | CompoundWidgetItem |
class | Config |
class | Display |
Abstract base class for all displays. More... | |
class | DisplaysPanel |
class | DisplayWrapper |
class | EditEnumItem |
class | EditEnumProperty |
class | EnumItem |
class | EnumProperty |
class | FixedOrientationOrthoViewController |
class | FlatColorPCTransformer |
class | FloatProperty |
class | FPSViewController |
struct | FrameInfo |
class | FrameManager |
Helper class for transforming data into Ogre's world frame (the fixed frame). More... | |
class | FrameSelectionHandler |
class | GoalTool |
class | Grid |
Displays a grid of cells, drawn with lines. More... | |
class | GridCellsDisplay |
Displays a nav_msgs::GridCells message. More... | |
class | GridDisplay |
Displays a grid along the XZ plane (XY in robot space) More... | |
class | HelpPanel |
class | ImageDisplay |
class | InitialPoseTool |
class | IntegerAction |
class | IntensityPCTransformer |
class | InteractionTool |
class | InteractiveMarker |
class | InteractiveMarkerClient |
class | InteractiveMarkerControl |
class | InteractiveMarkerDisplay |
Displays "markers" sent in by other ROS nodes on the "visualization_marker" topic. More... | |
class | InteractiveMarkerReceiver |
class | InteractiveObject |
Abstract base class of things in the scene which handle mouse events. More... | |
class | IntProperty |
class | LaserScanDisplay |
Visualizes a laser scan, received as a sensor_msgs::LaserScan. More... | |
class | LineEditWithButton |
class | LineListMarker |
class | LineStripMarker |
class | LinkComparator |
class | LinkUpdater |
class | LoadingDialog |
class | MapDisplay |
Displays a map along the XZ plane (XY in robot space) More... | |
class | MarkerArrayDisplay |
class | MarkerBase |
class | MarkerDisplay |
Displays "markers" sent in by other ROS nodes on the "visualization_marker" topic. More... | |
class | MarkerSelectionHandler |
class | MeshResourceMarker |
class | MovableText |
class | MoveTool |
class | NewObjectDialog |
class | Object |
Base class for visible objects, providing a minimal generic interface. More... | |
class | OdometryDisplay |
Accumulates and displays the pose from a nav_msgs::Odometry message. More... | |
class | OrbitCamera |
An orbital camera, controlled by yaw, pitch, distance, and focal point. More... | |
class | OrbitViewController |
An orbital camera, controlled by yaw, pitch, distance, and focal point. More... | |
class | Panel |
class | PanelDockWidget |
class | PathDisplay |
Displays a nav_msgs::Path message. More... | |
struct | Picked |
struct | Pixel |
class | PointCloud |
A visual representation of a set of points. More... | |
class | PointCloud2Display |
class | PointCloudBase |
Displays a point cloud of type sensor_msgs::PointCloud. More... | |
class | PointCloudDisplay |
Displays a point cloud of type sensor_msgs::PointCloud. More... | |
struct | PointCloudPoint |
class | PointCloudRenderable |
class | PointCloudSelectionHandler |
class | PointCloudTransformer |
class | PointsMarker |
class | PolygonDisplay |
Displays a geometry_msgs::PolygonStamped message. More... | |
class | PoseArrayDisplay |
Displays a std_msgs::ParticleCloud2D message. More... | |
class | PoseDisplay |
Accumulates and displays the pose from a geometry_msgs::PoseStamped message. More... | |
class | PoseDisplaySelectionHandler |
class | PoseTool |
class | Property |
Base class for properties. More... | |
class | PropertyBase |
Abstract base class for properties. More... | |
class | PropertyManager |
Manages a set of properties. More... | |
class | PropertyTreeDelegate |
class | PropertyTreeWidget |
class | PropertyTreeWithHelp |
class | PropertyWidgetItem |
class | QtOgreRenderWindow |
class | QuaternionProperty |
class | RangeDisplay |
Displays a sensor_msgs::Range message as a cone. More... | |
class | RenderAutoLock |
A scoped lock on the renderer. More... | |
class | RenderPanel |
class | RenderSystem |
class | RenderWidget |
class | ResourceIOStream |
class | ResourceIOSystem |
class | RGB8PCTransformer |
class | RGBF32PCTransformer |
class | Robot |
struct | RobotLink |
Contains any data we need from a link in the robot. More... | |
class | RobotLinkSelectionHandler |
class | RobotModelDisplay |
Uses a robot xml description to display the pieces of a robot at the transforms broadcast by rosTF. More... | |
class | ROSImageTexture |
class | RosTopicDialog |
class | RosTopicEditor |
class | ROSTopicStringProperty |
class | RosTopicTree |
class | ScaledImageWidget |
A widget for showing a scaled version of an image (QPixmap). More... | |
class | ScreenshotDialog |
A dialog for grabbing a screen shot. More... | |
class | SelectionHandler |
class | SelectionManager |
class | SelectionPanel |
class | SelectionTool |
class | Shape |
class | ShapeMarker |
class | SplashScreen |
class | SplitterHandle |
class | StatusProperty |
class | StringProperty |
class | TextViewFacingMarker |
class | TFDisplay |
Displays a visual representation of the TF hierarchy. More... | |
class | TFFrameProperty |
class | TFLinkUpdater |
class | TimePanel |
class | Tool |
class | ToolPropertiesPanel |
class | TopicItem |
class | TriangleListMarker |
class | UniformStringStream |
std::stringstream subclass which defaults to the "C" locale, so serialization of numbers is uniform across locales. More... | |
class | UnsupportedImageEncoding |
class | Vector3Property |
class | ViewController |
struct | ViewportMouseEvent |
class | ViewsPanel |
class | VisualizationFrame |
The main rviz window. More... | |
class | VisualizationManager |
The VisualizationManager class is the central manager class of rviz, holding all the Displays, Tools, ViewControllers, and other managers. More... | |
class | VisualizationPanel |
class | VisualizerApp |
class | WaitForMasterDialog |
class | WidgetGeometryChangeDetector |
Utility class for watching for events which indicate that widget geometry has changed. More... | |
class | WindowManagerInterface |
class | XYOrbitViewController |
Like the orbit view controller, but focal point moves only in the x-y plane. More... | |
class | XYZPCTransformer |
Typedefs | |
typedef std::pair< std::string, int > | Choice |
typedef std::vector< Choice > | Choices |
typedef uint32_t | CollObjectHandle |
typedef boost::shared_ptr < DisplayTypeInfo > | DisplayTypeInfoPtr |
typedef boost::function< void(V_string &)> | EditEnumOptionCallback |
typedef boost::shared_ptr < FrameManager > | FrameManagerPtr |
typedef boost::weak_ptr < FrameManager > | FrameManagerWPtr |
typedef boost::shared_ptr < InteractiveObject > | InteractiveObjectPtr |
typedef boost::weak_ptr < InteractiveObject > | InteractiveObjectWPtr |
typedef boost::unordered_map < CollObjectHandle, Picked > | M_Picked |
typedef boost::shared_ptr < MarkerBase > | MarkerBasePtr |
typedef std::pair< std::string, int32_t > | MarkerID |
typedef boost::shared_ptr < MarkerSelectionHandler > | MarkerSelectionHandlerPtr |
typedef std::map< std::pair < int, int >, V_Pixel > | MV_Pixel |
typedef boost::shared_ptr< Plugin > | PluginPtr |
typedef boost::shared_ptr < PointCloudRenderable > | PointCloudRenderablePtr |
typedef boost::shared_ptr < PointCloudSelectionHandler > | PointCloudSelectionHandlerPtr |
typedef boost::shared_ptr < PointCloudTransformer > | PointCloudTransformerPtr |
typedef boost::shared_ptr < PoseDisplaySelectionHandler > | PoseDisplaySelectionHandlerPtr |
typedef boost::function< void(void)> | RetransformFunc |
typedef boost::shared_ptr < RobotLinkSelectionHandler > | RobotLinkSelectionHandlerPtr |
typedef std::set < CollObjectHandle > | S_CollObject |
typedef std::set< FrameInfo * > | S_FrameInfo |
typedef std::set < Ogre::MaterialPtr > | S_MaterialPtr |
typedef std::set < SelectionHandlerPtr > | S_SelectionHandler |
typedef std::set< std::string > | S_string |
typedef std::set< uint64_t > | S_uint64 |
typedef boost::shared_ptr < SelectionHandler > | SelectionHandlerPtr |
typedef boost::function< void(const std::string &)> | StatusCallback |
typedef status_levels::StatusLevel | StatusLevel |
typedef std::vector < Ogre::AxisAlignedBox > | V_AABB |
typedef std::vector < CollObjectHandle > | V_CollObject |
typedef std::vector < DisplayWrapper * > | V_DisplayWrapper |
typedef std::vector< Pixel > | V_Pixel |
typedef std::vector < PointCloudPoint > | V_PointCloudPoint |
typedef std::vector < PointCloudRenderablePtr > | V_PointCloudRenderable |
typedef std::vector < PropertyBasePtr > | V_PropertyBasePtr |
typedef std::vector < PropertyBaseWPtr > | V_PropertyBaseWPtr |
typedef std::vector < SelectionHandlerPtr > | V_SelectionHandler |
typedef std::vector< std::string > | V_string |
typedef std::vector< uint64_t > | V_uint64 |
typedef std::vector< V_CollObject > | VV_CollObject |
Functions | |
static const Ogre::ColourValue | ARROW_HEAD_COLOR (1.0f, 0.1f, 0.6f, 1.0f) |
static const Ogre::ColourValue | ARROW_SHAFT_COLOR (0.8f, 0.8f, 0.3f, 1.0f) |
void | buildMesh (const aiScene *scene, const aiNode *node, const Ogre::MeshPtr &mesh, Ogre::AxisAlignedBox &aabb, float &radius) |
void | buildScaledOrthoMatrix (Ogre::Matrix4 &proj, float left, float right, float bottom, float top, float near, float far) |
static const QColor | CATEGORY_COLOR (4, 89, 127) |
void | cleanupOgre () |
uint32_t | colorToHandle (Ogre::PixelFormat fmt, uint32_t col) |
bool | convertPointCloudToPointCloud2 (const sensor_msgs::PointCloud &input, sensor_msgs::PointCloud2 &output) |
void | createColorMaterial (const std::string &name, const Ogre::ColourValue &color) |
void | deleteProperties (PropertyManager *man, V_PropertyBaseWPtr &props) |
static const QColor | ERROR_COLOR (178, 23, 46) |
int32_t | findChannelIndex (const sensor_msgs::PointCloud2ConstPtr &cloud, const std::string &channel) |
std::string | get_version () |
PropertyWidgetItem * | getCategoryPGProperty (const CategoryPropertyWPtr &wprop) |
static void | getRainbowColor (float value, Ogre::ColourValue &color) |
std::string | getTransformStatusName (const std::string &caller_id) |
template<typename T > | |
T | getValue (const T &val) |
template<class T > | |
void | hideProperty (boost::weak_ptr< T > &wprop) |
void | initializeResources (const V_string &resource_paths) |
Ogre::ColourValue | lerpColor (const Ogre::ColourValue &start, const Ogre::ColourValue &end, float t) |
void | linkUpdaterStatusFunction (StatusLevel level, const std::string &link_name, const std::string &text, RobotModelDisplay *display) |
void | loadMaterialsForMesh (const std::string &resource_path, const aiScene *scene, const Ogre::MeshPtr &mesh) |
Ogre::MeshPtr | loadMeshFromResource (const std::string &resource_path) |
void | loadTexture (const std::string &resource_path) |
void | makeClassNameToLookupNameMap (pluginlib::ClassLoader< Display > *class_loader, std::map< std::string, std::string > *map) |
Ogre::MeshPtr | meshFromAssimpScene (const std::string &name, const aiScene *scene) |
Ogre::Vector3 | pointFromCloud (const sensor_msgs::PointCloud2ConstPtr &cloud, uint32_t index) |
PROPERTY_FORWARD (PropertyBase) | |
PROPERTY_FORWARD (BoolProperty) | |
PROPERTY_FORWARD (IntProperty) | |
PROPERTY_FORWARD (FloatProperty) | |
PROPERTY_FORWARD (DoubleProperty) | |
PROPERTY_FORWARD (StringProperty) | |
PROPERTY_FORWARD (ColorProperty) | |
PROPERTY_FORWARD (EnumProperty) | |
PROPERTY_FORWARD (EditEnumProperty) | |
PROPERTY_FORWARD (CategoryProperty) | |
PROPERTY_FORWARD (Vector3Property) | |
PROPERTY_FORWARD (QuaternionProperty) | |
PROPERTY_FORWARD (ROSTopicStringProperty) | |
PROPERTY_FORWARD (StatusProperty) | |
PROPERTY_FORWARD (TFFrameProperty) | |
template<class T > | |
void | propertyChanged (boost::weak_ptr< T > &wprop) |
bool | reloadShaders (std_srvs::Empty::Request &, std_srvs::Empty::Response &) |
void | setAlphaBlending (const Ogre::MaterialPtr &mat) |
void | setPropertyHelpText (PropertyTreeWidget *grid, PropertyWidgetItem *widget_item, const std::string &text) |
template<class T > | |
void | setPropertyHelpText (boost::weak_ptr< T > &wprop, const std::string &text) |
void | setPropertyToColors (PropertyTreeWidget *grid, PropertyWidgetItem *widget_item, const QColor &fg_color, const QColor &bg_color, uint32_t column) |
void | setPropertyToDisabled (PropertyTreeWidget *grid, PropertyWidgetItem *property, uint32_t column) |
void | setPropertyToError (PropertyTreeWidget *grid, PropertyWidgetItem *property, uint32_t column) |
void | setPropertyToOK (PropertyTreeWidget *grid, PropertyWidgetItem *property, uint32_t column) |
void | setPropertyToWarn (PropertyTreeWidget *grid, PropertyWidgetItem *property, uint32_t column) |
void | setReplace (const Ogre::MaterialPtr &mat) |
template<class T > | |
void | showProperty (boost::weak_ptr< T > &wprop) |
bool | validateFloats (const visualization_msgs::InteractiveMarker &msg) |
bool | validateFloats (float val) |
bool | validateFloats (double val) |
bool | validateFloats (const Ogre::Vector3 &vec) |
bool | validateFloats (const sensor_msgs::CameraInfo &msg) |
bool | validateFloats (const Ogre::Quaternion &quat) |
bool | validateFloats (const geometry_msgs::Point &msg) |
bool | validateFloats (const geometry_msgs::Point32 &msg) |
bool | validateFloats (const geometry_msgs::Vector3 &msg) |
bool | validateFloats (const geometry_msgs::Twist &twist) |
bool | validateFloats (const geometry_msgs::Quaternion &msg) |
bool | validateFloats (const std_msgs::ColorRGBA &msg) |
bool | validateFloats (const geometry_msgs::PointStamped &msg) |
bool | validateFloats (const geometry_msgs::Pose &msg) |
bool | validateFloats (const geometry_msgs::PoseStamped &msg) |
template<typename T > | |
bool | validateFloats (const std::vector< T > &vec) |
template<typename T , size_t N> | |
bool | validateFloats (const boost::array< T, N > &arr) |
bool | validateFloats (const nav_msgs::Path &msg) |
bool | validateFloats (const geometry_msgs::PolygonStamped &msg) |
bool | validateFloats (const geometry_msgs::PoseArray &msg) |
bool | validateFloats (const nav_msgs::GridCells &msg) |
bool | validateFloats (const nav_msgs::Odometry &msg) |
bool | validateFloats (const nav_msgs::OccupancyGrid &msg) |
bool | validateFloats (const visualization_msgs::Marker &msg) |
template<typename T > | |
T | valueFromCloud (const sensor_msgs::PointCloud2ConstPtr &cloud, uint32_t offset, uint8_t type, uint32_t point_step, uint32_t index) |
static const QColor | WARN_COLOR (222, 213, 17) |
Variables | |
static const float | CAMERA_OFFSET = 0.2 |
static float | g_billboard_sphere_vertices [3 *3] |
static float | g_billboard_vertices [6 *3] |
static float | g_box_vertices [6 *6 *3] |
static float | g_point_vertices [3] |
static const std::string | IMAGE_POS_BACKGROUND = "background" |
static const std::string | IMAGE_POS_BOTH = "background & overlay" |
static const std::string | IMAGE_POS_OVERLAY = "overlay" |
static const float | MIN_DISTANCE = 0.01 |
static const float | PITCH_LIMIT_HIGH = Ogre::Math::PI - 0.001 |
static const float | PITCH_LIMIT_LOW = 0.001 |
static const float | PITCH_START = Ogre::Math::HALF_PI |
static const Ogre::Quaternion | ROBOT_TO_CAMERA_ROTATION |
static bool | x_baddrawable_error = false |
static const float | YAW_START = Ogre::Math::PI |
typedef std::pair<std::string, int> rviz::Choice |
Definition at line 456 of file property.h.
typedef std::vector<Choice> rviz::Choices |
Definition at line 457 of file property.h.
typedef uint32_t rviz::CollObjectHandle |
Definition at line 45 of file selection/forwards.h.
typedef boost::shared_ptr< DisplayTypeInfo > rviz::DisplayTypeInfoPtr |
Definition at line 47 of file display_wrapper.h.
typedef boost::function< void(V_string &)> rviz::EditEnumOptionCallback |
Definition at line 41 of file edit_enum_item.h.
typedef boost::shared_ptr< FrameManager > rviz::FrameManagerPtr |
Definition at line 55 of file frame_manager.h.
typedef boost::weak_ptr<FrameManager> rviz::FrameManagerWPtr |
Definition at line 57 of file frame_manager.h.
typedef boost::shared_ptr<InteractiveObject> rviz::InteractiveObjectPtr |
Definition at line 54 of file interactive_object.h.
typedef boost::weak_ptr<InteractiveObject> rviz::InteractiveObjectWPtr |
Definition at line 55 of file interactive_object.h.
typedef boost::unordered_map<CollObjectHandle, Picked> rviz::M_Picked |
Definition at line 100 of file selection/forwards.h.
typedef boost::shared_ptr< MarkerBase > rviz::MarkerBasePtr |
Definition at line 67 of file interactive_marker_display.h.
typedef std::pair< std::string, int32_t > rviz::MarkerID |
Definition at line 70 of file interactive_marker_display.h.
typedef boost::shared_ptr< MarkerSelectionHandler > rviz::MarkerSelectionHandlerPtr |
Definition at line 64 of file interactive_marker_display.h.
typedef std::map<std::pair<int, int>, V_Pixel> rviz::MV_Pixel |
Definition at line 84 of file selection/forwards.h.
typedef boost::shared_ptr<Plugin> rviz::PluginPtr |
Definition at line 49 of file display_wrapper.h.
typedef boost::shared_ptr<PointCloudRenderable> rviz::PointCloudRenderablePtr |
Definition at line 83 of file point_cloud.h.
typedef boost::shared_ptr<PointCloudSelectionHandler> rviz::PointCloudSelectionHandlerPtr |
Definition at line 63 of file point_cloud_base.h.
typedef boost::shared_ptr<PointCloudTransformer> rviz::PointCloudTransformerPtr |
Definition at line 65 of file point_cloud_base.h.
typedef boost::shared_ptr<PoseDisplaySelectionHandler> rviz::PoseDisplaySelectionHandlerPtr |
Definition at line 62 of file pose_display.h.
typedef boost::function<void(void)> rviz::RetransformFunc |
Definition at line 61 of file point_cloud_transformer.h.
typedef boost::shared_ptr<RobotLinkSelectionHandler> rviz::RobotLinkSelectionHandlerPtr |
Definition at line 82 of file robot_link.h.
typedef std::set<CollObjectHandle> rviz::S_CollObject |
Definition at line 48 of file selection/forwards.h.
typedef std::set< FrameInfo * > rviz::S_FrameInfo |
Definition at line 189 of file tf_display.cpp.
typedef std::set<Ogre::MaterialPtr> rviz::S_MaterialPtr |
Definition at line 57 of file marker_base.h.
Definition at line 151 of file selection_handler.h.
typedef std::set<std::string> rviz::S_string |
Definition at line 53 of file new_object_dialog.h.
typedef std::set<uint64_t> rviz::S_uint64 |
Definition at line 86 of file selection/forwards.h.
typedef boost::shared_ptr<SelectionHandler> rviz::SelectionHandlerPtr |
Definition at line 149 of file selection_handler.h.
typedef boost::function<void(const std::string&)> rviz::StatusCallback |
Definition at line 45 of file properties/forwards.h.
Definition at line 44 of file status_level.h.
typedef std::vector<Ogre::AxisAlignedBox> rviz::V_AABB |
Definition at line 59 of file selection_handler.h.
Definition at line 46 of file selection/forwards.h.
typedef std::vector< DisplayWrapper * > rviz::V_DisplayWrapper |
Definition at line 52 of file displays_panel.h.
typedef std::vector<Pixel> rviz::V_Pixel |
Definition at line 83 of file selection/forwards.h.
Definition at line 59 of file point_cloud_transformer.h.
Definition at line 84 of file point_cloud.h.
typedef std::vector<PropertyBasePtr> rviz::V_PropertyBasePtr |
Definition at line 73 of file properties/forwards.h.
typedef std::vector<PropertyBaseWPtr> rviz::V_PropertyBaseWPtr |
Definition at line 74 of file properties/forwards.h.
Definition at line 150 of file selection_handler.h.
typedef std::vector< std::string > rviz::V_string |
Definition at line 40 of file point_cloud_transformers.h.
typedef std::vector<uint64_t> rviz::V_uint64 |
Definition at line 87 of file selection/forwards.h.
typedef std::vector<V_CollObject> rviz::VV_CollObject |
Definition at line 47 of file selection/forwards.h.
static const Ogre::ColourValue rviz::ARROW_HEAD_COLOR | ( | 1. | 0f, |
0. | 1f, | ||
0. | 6f, | ||
1. | 0f | ||
) | [static] |
static const Ogre::ColourValue rviz::ARROW_SHAFT_COLOR | ( | 0. | 8f, |
0. | 8f, | ||
0. | 3f, | ||
1. | 0f | ||
) | [static] |
void rviz::buildMesh | ( | const aiScene * | scene, |
const aiNode * | node, | ||
const Ogre::MeshPtr & | mesh, | ||
Ogre::AxisAlignedBox & | aabb, | ||
float & | radius | ||
) |
Definition at line 197 of file mesh_loader.cpp.
void rviz::buildScaledOrthoMatrix | ( | Ogre::Matrix4 & | proj, |
float | left, | ||
float | right, | ||
float | bottom, | ||
float | top, | ||
float | near, | ||
float | far | ||
) |
Definition at line 8 of file orthographic.cpp.
static const QColor rviz::CATEGORY_COLOR | ( | 4 | , |
89 | , | ||
127 | |||
) | [static] |
void rviz::cleanupOgre | ( | ) |
Definition at line 15 of file initialization.cpp.
uint32_t rviz::colorToHandle | ( | Ogre::PixelFormat | fmt, |
uint32_t | col | ||
) | [inline] |
Definition at line 103 of file selection/forwards.h.
bool rviz::convertPointCloudToPointCloud2 | ( | const sensor_msgs::PointCloud & | input, |
sensor_msgs::PointCloud2 & | output | ||
) |
Definition at line 1041 of file point_cloud_base.cpp.
void rviz::createColorMaterial | ( | const std::string & | name, |
const Ogre::ColourValue & | color | ||
) |
Definition at line 237 of file visualization_manager.cpp.
void rviz::deleteProperties | ( | PropertyManager * | man, |
V_PropertyBaseWPtr & | props | ||
) |
Definition at line 407 of file point_cloud_base.cpp.
static const QColor rviz::ERROR_COLOR | ( | 178 | , |
23 | , | ||
46 | |||
) | [static] |
int32_t rviz::findChannelIndex | ( | const sensor_msgs::PointCloud2ConstPtr & | cloud, |
const std::string & | channel | ||
) | [inline] |
Definition at line 42 of file point_cloud_transformers.h.
std::string rviz::get_version | ( | ) |
PropertyWidgetItem* rviz::getCategoryPGProperty | ( | const CategoryPropertyWPtr & | wprop | ) |
Definition at line 63 of file property.cpp.
static void rviz::getRainbowColor | ( | float | value, |
Ogre::ColourValue & | color | ||
) | [static] |
Definition at line 41 of file point_cloud_transformers.cpp.
std::string rviz::getTransformStatusName | ( | const std::string & | caller_id | ) |
Definition at line 192 of file frame_manager.cpp.
T rviz::getValue | ( | const T & | val | ) |
Definition at line 56 of file point_cloud_base.cpp.
void rviz::hideProperty | ( | boost::weak_ptr< T > & | wprop | ) |
Definition at line 86 of file properties/forwards.h.
void rviz::initializeResources | ( | const V_string & | resource_paths | ) |
Definition at line 22 of file initialization.cpp.
Ogre::ColourValue rviz::lerpColor | ( | const Ogre::ColourValue & | start, |
const Ogre::ColourValue & | end, | ||
float | t | ||
) |
Definition at line 485 of file tf_display.cpp.
void rviz::linkUpdaterStatusFunction | ( | StatusLevel | level, |
const std::string & | link_name, | ||
const std::string & | text, | ||
RobotModelDisplay * | display | ||
) |
Definition at line 47 of file robot_model_display.cpp.
void rviz::loadMaterialsForMesh | ( | const std::string & | resource_path, |
const aiScene * | scene, | ||
const Ogre::MeshPtr & | mesh | ||
) |
Definition at line 403 of file mesh_loader.cpp.
Ogre::MeshPtr rviz::loadMeshFromResource | ( | const std::string & | resource_path | ) |
Definition at line 561 of file mesh_loader.cpp.
void rviz::loadTexture | ( | const std::string & | resource_path | ) |
Definition at line 363 of file mesh_loader.cpp.
void rviz::makeClassNameToLookupNameMap | ( | pluginlib::ClassLoader< Display > * | class_loader, |
std::map< std::string, std::string > * | map | ||
) |
Definition at line 675 of file visualization_manager.cpp.
Ogre::MeshPtr rviz::meshFromAssimpScene | ( | const std::string & | name, |
const aiScene * | scene | ||
) |
Definition at line 536 of file mesh_loader.cpp.
Ogre::Vector3 rviz::pointFromCloud | ( | const sensor_msgs::PointCloud2ConstPtr & | cloud, |
uint32_t | index | ||
) |
Definition at line 147 of file point_cloud_base.cpp.
rviz::PROPERTY_FORWARD | ( | PropertyBase | ) |
rviz::PROPERTY_FORWARD | ( | BoolProperty | ) |
rviz::PROPERTY_FORWARD | ( | IntProperty | ) |
rviz::PROPERTY_FORWARD | ( | FloatProperty | ) |
rviz::PROPERTY_FORWARD | ( | DoubleProperty | ) |
rviz::PROPERTY_FORWARD | ( | StringProperty | ) |
rviz::PROPERTY_FORWARD | ( | ColorProperty | ) |
rviz::PROPERTY_FORWARD | ( | EnumProperty | ) |
rviz::PROPERTY_FORWARD | ( | EditEnumProperty | ) |
rviz::PROPERTY_FORWARD | ( | CategoryProperty | ) |
rviz::PROPERTY_FORWARD | ( | Vector3Property | ) |
rviz::PROPERTY_FORWARD | ( | QuaternionProperty | ) |
rviz::PROPERTY_FORWARD | ( | ROSTopicStringProperty | ) |
rviz::PROPERTY_FORWARD | ( | StatusProperty | ) |
rviz::PROPERTY_FORWARD | ( | TFFrameProperty | ) |
void rviz::propertyChanged | ( | boost::weak_ptr< T > & | wprop | ) |
Definition at line 77 of file properties/forwards.h.
bool rviz::reloadShaders | ( | std_srvs::Empty::Request & | , |
std_srvs::Empty::Response & | |||
) |
Definition at line 62 of file visualizer_app.cpp.
void rviz::setAlphaBlending | ( | const Ogre::MaterialPtr & | mat | ) |
Definition at line 363 of file point_cloud.cpp.
void rviz::setPropertyHelpText | ( | PropertyTreeWidget * | grid, |
PropertyWidgetItem * | widget_item, | ||
const std::string & | text | ||
) |
Definition at line 75 of file property.cpp.
void rviz::setPropertyHelpText | ( | boost::weak_ptr< T > & | wprop, |
const std::string & | text | ||
) |
Definition at line 104 of file properties/forwards.h.
void rviz::setPropertyToColors | ( | PropertyTreeWidget * | grid, |
PropertyWidgetItem * | widget_item, | ||
const QColor & | fg_color, | ||
const QColor & | bg_color, | ||
uint32_t | column | ||
) |
Definition at line 86 of file property.cpp.
void rviz::setPropertyToDisabled | ( | PropertyTreeWidget * | grid, |
PropertyWidgetItem * | property, | ||
uint32_t | column | ||
) |
Definition at line 112 of file property.cpp.
void rviz::setPropertyToError | ( | PropertyTreeWidget * | grid, |
PropertyWidgetItem * | property, | ||
uint32_t | column | ||
) |
Definition at line 97 of file property.cpp.
void rviz::setPropertyToOK | ( | PropertyTreeWidget * | grid, |
PropertyWidgetItem * | property, | ||
uint32_t | column | ||
) |
Definition at line 107 of file property.cpp.
void rviz::setPropertyToWarn | ( | PropertyTreeWidget * | grid, |
PropertyWidgetItem * | property, | ||
uint32_t | column | ||
) |
Definition at line 102 of file property.cpp.
void rviz::setReplace | ( | const Ogre::MaterialPtr & | mat | ) |
Definition at line 372 of file point_cloud.cpp.
void rviz::showProperty | ( | boost::weak_ptr< T > & | wprop | ) |
Definition at line 95 of file properties/forwards.h.
bool rviz::validateFloats | ( | const visualization_msgs::InteractiveMarker & | msg | ) |
Definition at line 48 of file interactive_marker_display.cpp.
bool rviz::validateFloats | ( | float | val | ) | [inline] |
Definition at line 49 of file validate_floats.h.
bool rviz::validateFloats | ( | double | val | ) | [inline] |
Definition at line 54 of file validate_floats.h.
bool rviz::validateFloats | ( | const Ogre::Vector3 & | vec | ) | [inline] |
Definition at line 59 of file validate_floats.h.
bool rviz::validateFloats | ( | const sensor_msgs::CameraInfo & | msg | ) |
Definition at line 66 of file camera_display.cpp.
bool rviz::validateFloats | ( | const Ogre::Quaternion & | quat | ) | [inline] |
Definition at line 68 of file validate_floats.h.
bool rviz::validateFloats | ( | const geometry_msgs::Point & | msg | ) | [inline] |
Definition at line 78 of file validate_floats.h.
bool rviz::validateFloats | ( | const geometry_msgs::Point32 & | msg | ) | [inline] |
Definition at line 87 of file validate_floats.h.
bool rviz::validateFloats | ( | const geometry_msgs::Vector3 & | msg | ) | [inline] |
Definition at line 96 of file validate_floats.h.
bool rviz::validateFloats | ( | const geometry_msgs::Twist & | twist | ) | [inline] |
Definition at line 105 of file validate_floats.h.
bool rviz::validateFloats | ( | const geometry_msgs::Quaternion & | msg | ) | [inline] |
Definition at line 113 of file validate_floats.h.
bool rviz::validateFloats | ( | const std_msgs::ColorRGBA & | msg | ) | [inline] |
Definition at line 123 of file validate_floats.h.
bool rviz::validateFloats | ( | const geometry_msgs::PointStamped & | msg | ) | [inline] |
Definition at line 133 of file validate_floats.h.
bool rviz::validateFloats | ( | const geometry_msgs::Pose & | msg | ) | [inline] |
Definition at line 138 of file validate_floats.h.
bool rviz::validateFloats | ( | const geometry_msgs::PoseStamped & | msg | ) | [inline] |
Definition at line 146 of file validate_floats.h.
bool rviz::validateFloats | ( | const std::vector< T > & | vec | ) | [inline] |
Definition at line 152 of file validate_floats.h.
bool rviz::validateFloats | ( | const boost::array< T, N > & | arr | ) | [inline] |
Definition at line 169 of file validate_floats.h.
bool rviz::validateFloats | ( | const nav_msgs::Path & | msg | ) |
Definition at line 174 of file path_display.cpp.
bool rviz::validateFloats | ( | const geometry_msgs::PolygonStamped & | msg | ) |
Definition at line 176 of file polygon_display.cpp.
bool rviz::validateFloats | ( | const geometry_msgs::PoseArray & | msg | ) |
Definition at line 184 of file pose_array_display.cpp.
bool rviz::validateFloats | ( | const nav_msgs::GridCells & | msg | ) |
Definition at line 196 of file grid_cells_display.cpp.
bool rviz::validateFloats | ( | const nav_msgs::Odometry & | msg | ) |
Definition at line 229 of file odometry_display.cpp.
bool rviz::validateFloats | ( | const nav_msgs::OccupancyGrid & | msg | ) |
Definition at line 237 of file map_display.cpp.
bool rviz::validateFloats | ( | const visualization_msgs::Marker & | msg | ) |
Definition at line 296 of file marker_display.cpp.
T rviz::valueFromCloud | ( | const sensor_msgs::PointCloud2ConstPtr & | cloud, |
uint32_t | offset, | ||
uint8_t | type, | ||
uint32_t | point_step, | ||
uint32_t | index | ||
) | [inline] |
Definition at line 56 of file point_cloud_transformers.h.
static const QColor rviz::WARN_COLOR | ( | 222 | , |
213 | , | ||
17 | |||
) | [static] |
const float rviz::CAMERA_OFFSET = 0.2 [static] |
Definition at line 57 of file xy_orbit_view_controller.cpp.
float rviz::g_billboard_sphere_vertices[3 *3] [static] |
{ 0.0f, 1.5f, 0.0f, -1.5f, -1.5f, 0.0f, 1.5f, -1.5f, 0.0f, }
Definition at line 72 of file point_cloud.cpp.
float rviz::g_billboard_vertices[6 *3] [static] |
{ -0.5f, 0.5f, 0.0f, -0.5f, -0.5f, 0.0f, 0.5f, 0.5f, 0.0f, 0.5f, 0.5f, 0.0f, -0.5f, -0.5f, 0.0f, 0.5f, -0.5f, 0.0f, }
Definition at line 62 of file point_cloud.cpp.
float rviz::g_box_vertices[6 *6 *3] [static] |
Definition at line 79 of file point_cloud.cpp.
float rviz::g_point_vertices[3] [static] |
{ 0.0f, 0.0f, 0.0f }
Definition at line 57 of file point_cloud.cpp.
const std::string rviz::IMAGE_POS_BACKGROUND = "background" [static] |
Definition at line 62 of file camera_display.cpp.
const std::string rviz::IMAGE_POS_BOTH = "background & overlay" [static] |
Definition at line 64 of file camera_display.cpp.
const std::string rviz::IMAGE_POS_OVERLAY = "overlay" [static] |
Definition at line 63 of file camera_display.cpp.
const float rviz::MIN_DISTANCE = 0.01 [static] |
Definition at line 49 of file orbit_view_controller.cpp.
static const float rviz::PITCH_LIMIT_HIGH = Ogre::Math::PI - 0.001 [static] |
Definition at line 49 of file orbit_camera.cpp.
static const float rviz::PITCH_LIMIT_LOW = 0.001 [static] |
Definition at line 48 of file orbit_camera.cpp.
static const float rviz::PITCH_START = Ogre::Math::HALF_PI [static] |
Definition at line 51 of file orbit_camera.cpp.
const Ogre::Quaternion rviz::ROBOT_TO_CAMERA_ROTATION [static] |
Ogre::Quaternion( Ogre::Radian( -Ogre::Math::HALF_PI ), Ogre::Vector3::UNIT_Y ) * Ogre::Quaternion( Ogre::Radian( -Ogre::Math::HALF_PI ), Ogre::Vector3::UNIT_Z )
Definition at line 49 of file fps_view_controller.cpp.
bool rviz::x_baddrawable_error = false [static] |
Definition at line 178 of file render_system.cpp.
static const float rviz::YAW_START = Ogre::Math::PI [static] |
Definition at line 50 of file orbit_camera.cpp.