Classes | |
| class | _RosTopicDisplay |
| Helper superclass for MessageFilterDisplay, needed because Qt's moc and c++ templates don't work nicely together. Not intended to be used directly. More... | |
| class | AddDisplayDialog |
| class | AlphaSetter |
| 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 of a chosen frame. More... | |
| class | AxisColorPCTransformer |
| class | BillboardLine |
| An object that displays a multi-segment line strip rendered as billboards. More... | |
| class | BitAllocator |
| Allocation manager for bit positions within a 32-bit word. More... | |
| class | BoolProperty |
| Property specialized to provide getter for booleans. More... | |
| class | CameraBase |
| Generic interface for a camera. More... | |
| class | CameraDisplay |
| class | ClassIdRecordingFactory |
| Templated factory which informs objects created by it what their class identifier string was. calls a setClassId() function on any instances created by a protected makeRaw() function (pure virtual in this class). More... | |
| struct | Color |
| class | ColorEditor |
| class | ColorProperty |
| class | ComboBox |
| class | Config |
| Configuration data storage class. More... | |
| class | DepthCloudDisplay |
| struct | DepthTraits |
| struct | DepthTraits< float > |
| struct | DepthTraits< uint16_t > |
| class | Display |
| class | DisplayContext |
| Pure-virtual base class for objects which give Display subclasses context in which to work. More... | |
| class | DisplayFactory |
| class | DisplayGroup |
| A Display object which stores other Displays as children. More... | |
| class | DisplayGroupVisibilityProperty |
| class | DisplaysPanel |
| class | DisplayTypeTree |
| Widget for selecting a display by display type. More... | |
| class | DisplayVisibilityProperty |
| class | EditableComboBox |
| class | EditableEnumProperty |
| Editable Enum property. More... | |
| class | EffortDisplay |
| class | EffortVisual |
| class | EmbeddableComboBox |
| class | EnumProperty |
| Enum property. More... | |
| class | Factory |
| Abstract superclass representing the ability to get a list of class IDs and the ability to get name, description, and package strings for each. Actually instantiating objects must be done by subclasses specialized for specific types. More... | |
| class | FailedDisplay |
| A FailedDisplay instance represents a Display class we tried and failed to instantiate. More... | |
| class | FailedPanel |
| class | FailedTool |
| A FailedTool instance represents a Tool class we tried and failed to instantiate. More... | |
| class | FailedViewController |
| A FailedViewController instance represents a ViewController class we tried and failed to instantiate. More... | |
| class | FailureProperty |
| class | FixedOrientationOrthoViewController |
| class | FlatColorPCTransformer |
| class | FloatEdit |
| class | FloatProperty |
| Property specialized to enforce floating point max/min. More... | |
| class | FluidPressureDisplay |
| Displays an FluidPressure message of type sensor_msgs::FluidPressure. More... | |
| class | FocusTool |
| class | FPSViewController |
| A first-person camera, controlled by yaw, pitch, and position. More... | |
| class | FrameInfo |
| Internal class needed only by TFDisplay. More... | |
| class | FrameManager |
| Helper class for transforming data into Ogre's world frame (the fixed frame). More... | |
| class | FramePositionTrackingViewController |
| Base class of ViewControllers which have a "Target Frame" which is a TF frame whose position they track. 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 in either the XY, YZ, or XZ plane. More... | |
| class | HelpPanel |
| class | IconizedProperty |
| class | IlluminanceDisplay |
| Displays an Illuminance message of type sensor_msgs::Illuminance. More... | |
| class | ImageDisplay |
| class | ImageDisplayBase |
| Display subclass for subscribing and displaying to image messages. More... | |
| struct | IndexAndMessage |
| class | InitialPoseTool |
| class | IntegerAction |
| class | IntensityPCTransformer |
| class | InteractionTool |
| class | InteractiveMarker |
| class | InteractiveMarkerControl |
| class | InteractiveMarkerDisplay |
| Displays Interactive Markers. More... | |
| class | InteractiveObject |
| Abstract base class of things in the scene which handle mouse events. More... | |
| class | IntProperty |
| Property specialized to provide max/min enforcement for integers. More... | |
| class | JointInfo |
| class | LaserScanDisplay |
| Visualizes a laser scan, received as a sensor_msgs::LaserScan. More... | |
| struct | LexicalTopicInfo |
| class | Line |
| class | LineEditWithButton |
| class | LineListMarker |
| class | LineStripMarker |
| class | LinkUpdater |
| class | LoadingDialog |
| class | MapDisplay |
| Displays a map along the XY plane. More... | |
| class | MarkerArrayDisplay |
| Display for an array of markers. The MarkerDisplay class handles MarkerArray messages. This is just a wrapper to let MarkerArray topics get selected in the topic browser. More... | |
| class | MarkerBase |
| class | MarkerDisplay |
| Displays "markers" sent in by other ROS nodes on the "visualization_marker" topic. More... | |
| class | MarkerNamespace |
| Manager of a single marker namespace. Keeps a hash from marker IDs to MarkerBasePtr, and creates or destroys them when . More... | |
| class | MarkerSelectionHandler |
| class | MeasureTool |
| class | MeshResourceMarker |
| class | MeshShape |
| This class allows constructing Ogre shapes manually, from triangle lists. More... | |
| class | MessageFilterDisplay |
| Display subclass using a tf::MessageFilter, templated on the ROS message type. More... | |
| class | MessageFilterJointStateDisplay |
| Display subclass using a tf::MessageFilter, templated on the ROS message type. More... | |
| class | MockContext |
| class | MockDisplay |
| class | MockDisplayFactory |
| class | MockPropertyChangeReceiver |
| class | MovableText |
| class | MoveTool |
| class | MultiLayerDepth |
| class | MultiLayerDepthException |
| 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 | OgreLogging |
| Convenience interface to Ogre logging. More... | |
| class | OgreRenderQueueClearer |
| 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 |
| Dock widget class for docking widgets into VisualizationFrame. More... | |
| class | PanelFactory |
| class | PathDisplay |
| Displays a nav_msgs::Path message. More... | |
| class | PickColorSetter |
| struct | Picked |
| struct | PluginGroup |
| class | PluginlibFactory |
| class | PointCloud |
| A visual representation of a set of points. More... | |
| class | PointCloud2Display |
| Displays a point cloud of type sensor_msgs::PointCloud2. More... | |
| class | PointCloudCommon |
| Displays a point cloud of type sensor_msgs::PointCloud. More... | |
| class | PointCloudDisplay |
| Displays a point cloud of type sensor_msgs::PointCloud. More... | |
| class | PointCloudRenderable |
| class | PointCloudSelectionHandler |
| class | PointCloudTransformer |
| class | PointsMarker |
| class | PointStampedDisplay |
| class | PointStampedVisual |
| class | PointTool |
| class | PolygonDisplay |
| Displays a geometry_msgs::PolygonStamped message. More... | |
| class | PoseArrayDisplay |
| Displays a geometry_msgs/PoseArray message as a bunch of line-drawn arrows. More... | |
| class | PoseDisplay |
| Accumulates and displays the pose from a geometry_msgs::PoseStamped message. More... | |
| class | PoseDisplaySelectionHandler |
| class | PoseTool |
| class | Property |
| A single element of a property tree, with a name, value, description, and possibly children. More... | |
| class | PropertyTreeDelegate |
| class | PropertyTreeModel |
| class | PropertyTreeWidget |
| class | PropertyTreeWithHelp |
| class | QtOgreRenderWindow |
| class | QuaternionProperty |
| class | RangeDisplay |
| Displays a sensor_msgs::Range message as a cone. More... | |
| class | RelativeHumidityDisplay |
| Displays a RelativeHumidity message of type sensor_msgs::RelativeHumidity. More... | |
| class | RenderPanel |
| class | RenderSystem |
| class | RenderWidget |
| class | ResourceIOStream |
| class | ResourceIOSystem |
| class | RGB8PCTransformer |
| struct | RGBA |
| class | RGBF32PCTransformer |
| class | Robot |
| struct | RobotJoint |
| Contains any data we need from a joint in the robot. More... | |
| 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 | RosFilteredTopicProperty |
| class | ROSImageTexture |
| class | RosLogListener |
| class | RosTopicProperty |
| class | ScaledImageWidget |
| A widget for showing a scaled version of an image (QPixmap). More... | |
| class | ScreenshotDialog |
| A dialog for grabbing a screen shot. More... | |
| struct | SelectionData |
| class | SelectionHandler |
| class | SelectionManager |
| class | SelectionPanel |
| class | SelectionTool |
| class | Shape |
| class | ShapeMarker |
| class | SplashScreen |
| class | SplitterHandle |
| A tall skinny invisible widget providing left-right sliding column separator adjustment for a two-column QTreeView via mouse drags. Shows splitter cursor when mouse hovers over it. Uses event filtering to catch resize events for the parent. More... | |
| class | StatusList |
| class | StatusProperty |
| class | StringProperty |
| Property specialized for string values. More... | |
| class | TemperatureDisplay |
| Displays a Temperature message of type sensor_msgs::Temperature. More... | |
| class | TextViewFacingMarker |
| class | TFDisplay |
| Displays a visual representation of the TF hierarchy. More... | |
| class | TfFrameProperty |
| class | TFLinkUpdater |
| class | ThirdPersonFollowerViewController |
| Like the orbit view controller, but focal point moves only in the x-y plane. More... | |
| class | TimePanel |
| class | Tool |
| class | ToolManager |
| class | ToolPropertiesPanel |
| class | TopicDisplayWidget |
| Widget for selecting a display by topic. More... | |
| 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 | VectorProperty |
| class | ViewController |
| class | ViewControllerContainer |
| Container property for ViewControllers which gets the drag/drop right for the funky way Current-View is always the first entry. More... | |
| class | ViewManager |
| class | ViewportMouseEvent |
| class | ViewsPanel |
| Panel for choosing the view controller and saving and restoring viewpoints. More... | |
| 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 | VisualizationManagerPrivate |
| class | VisualizerApp |
| class | WaitForMasterDialog |
| class | WidgetGeometryChangeDetector |
| Utility class for watching for events which indicate that widget geometry has changed. More... | |
| class | WindowManagerInterface |
| class | WrenchStampedDisplay |
| class | WrenchStampedVisual |
| class | XYOrbitViewController |
| Like the orbit view controller, but focal point moves only in the x-y plane. More... | |
| class | XYZPCTransformer |
| class | YamlConfigReader |
| class | YamlConfigWriter |
Typedefs | |
| typedef uint32_t | CollObjectHandle |
| typedef boost::shared_ptr < FrameSelectionHandler > | FrameSelectionHandlerPtr |
| 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 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::shared_ptr < RobotLinkSelectionHandler > | RobotLinkSelectionHandlerPtr |
| typedef std::set < CollObjectHandle > | S_CollObject |
| typedef std::set< FrameInfo * > | S_FrameInfo |
| typedef std::set< JointInfo * > | S_JointInfo |
| typedef std::set < Ogre::MaterialPtr > | S_MaterialPtr |
| typedef std::set < SelectionHandlerPtr > | S_SelectionHandler |
| typedef std::set< uint64_t > | S_uint64 |
| typedef boost::shared_ptr < SelectionHandler > | SelectionHandlerPtr |
| typedef StatusProperty::Level | StatusLevel |
| typedef std::vector < Ogre::AxisAlignedBox > | V_AABB |
| typedef std::vector < CollObjectHandle > | V_CollObject |
| typedef std::vector < PointCloud::Point > | V_PointCloudPoint |
| typedef std::vector < PointCloudRenderablePtr > | V_PointCloudRenderable |
| 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 | |
| QString | addSpaceToCamelCase (QString input) |
| void | applyVisibilityBits (uint32_t bits, Ogre::SceneNode *node) |
| 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, const float scale, std::vector< Ogre::MaterialPtr > &material_table) |
| Recursive mesh-building function. | |
| void | buildScaledOrthoMatrix (Ogre::Matrix4 &proj, float left, float right, float bottom, float top, float near, float far) |
| void | cleanupOgre () |
| uint32_t | colorToHandle (Ogre::PixelFormat fmt, uint32_t col) |
| CollObjectHandle | colorToHandle (const Ogre::ColourValue &color) |
| bool | convertPointCloudToPointCloud2 (const sensor_msgs::PointCloud &input, sensor_msgs::PointCloud2 &output) |
| void | createColorMaterial (const std::string &name, const Ogre::ColourValue &color, bool use_self_illumination) |
| int32_t | findChannelIndex (const sensor_msgs::PointCloud2ConstPtr &cloud, const std::string &channel) |
| QString | findMaxCommonPrefix (const QStringList &strings) |
| std::string | get_distro () |
| std::string | get_ogre_plugin_path () |
| std::string | get_version () |
| QCursor | getDefaultCursor (bool fill_cache) |
| float | getMeshUnitRescale (const std::string &resource_path) |
| boost::filesystem::path | getPath (QString url) |
| void | getPluginGroups (const QMap< QString, QString > &datatype_plugins, QList< PluginGroup > *groups, QList< ros::master::TopicInfo > *unvisualizable) |
| bool | getPointOnPlaneFromWindowXY (Ogre::Viewport *viewport, Ogre::Plane &plane, int window_x, int window_y, Ogre::Vector3 &intersection_out) |
| Given a viewport and an x,y position in window-pixel coordinates, find the point on a plane directly behind it, if any. | |
| static void | getRainbowColor (float value, Ogre::ColourValue &color) |
| std::string | getTransformStatusName (const std::string &caller_id) |
| void | initializeResources (const V_string &resource_paths) |
| bool | isSubtopic (const std::string &base, const std::string &topic) |
| Ogre::ColourValue | lerpColor (const Ogre::ColourValue &start, const Ogre::ColourValue &end, float t) |
| static int | limit (int i) |
| void | linkUpdaterStatusFunction (StatusProperty::Level level, const std::string &link_name, const std::string &text, RobotModelDisplay *display) |
| void | loadMaterials (const std::string &resource_path, const aiScene *scene, std::vector< Ogre::MaterialPtr > &material_table_out) |
| Load all materials needed by the given scene. | |
| Ogre::MeshPtr | loadMeshFromResource (const std::string &resource_path) |
| QPixmap | loadPixmap (QString url, bool fill_cache) |
| void | loadTexture (const std::string &resource_path) |
| unsigned char * | makeCostmapPalette () |
| QCursor | makeIconCursor (QString url, bool fill_cache) |
| QCursor | makeIconCursor (QPixmap icon, QString cache_key, bool fill_cache) |
| unsigned char * | makeMapPalette () |
| Ogre::TexturePtr | makePaletteTexture (unsigned char *palette_bytes) |
| unsigned char * | makeRawPalette () |
| float | mapAngleTo0_2Pi (float angle) |
| Return the input angle mapped back to the range 0 to 2*PI. | |
| Ogre::MeshPtr | meshFromAssimpScene (const std::string &name, const aiScene *scene) |
| static Display * | newDisplayGroup () |
| static Panel * | newDisplaysPanel () |
| static Panel * | newHelpPanel () |
| static Panel * | newSelectionPanel () |
| static Panel * | newTimePanel () |
| static Panel * | newToolPropertiesPanel () |
| static Panel * | newViewsPanel () |
| QColor | ogreToQt (const Ogre::ColourValue &c) |
| bool | operator== (IndexAndMessage a, IndexAndMessage b) |
| QColor | parseColor (const QString &color_string) |
| Ogre::Vector3 | pointFromCloud (const sensor_msgs::PointCloud2ConstPtr &cloud, uint32_t index) |
| static Ogre::Vector3 | pointMsgToOgre (const geometry_msgs::Point &m) |
| static void | pointMsgToOgre (const geometry_msgs::Point &m, Ogre::Vector3 &o) |
| static void | pointOgreToMsg (const Ogre::Vector3 &o, geometry_msgs::Point &m) |
| static geometry_msgs::Point | pointOgreToMsg (const Ogre::Vector3 &o) |
| QString | printColor (const QColor &color) |
| Ogre::Vector2 | project3DPointToViewportXY (const Ogre::Viewport *view, const Ogre::Vector3 &pos) |
| Given a viewport and a 3D position in world coordinates, project that point into the view plane. | |
| uint | qHash (IndexAndMessage iam) |
| Ogre::ColourValue | qtToOgre (const QColor &c) |
| static Ogre::Quaternion | quaternionMsgToOgre (const geometry_msgs::Quaternion &m) |
| static void | quaternionMsgToOgre (const geometry_msgs::Quaternion &m, Ogre::Quaternion &o) |
| static void | quaternionOgreToMsg (const Ogre::Quaternion &o, geometry_msgs::Quaternion &m) |
| static geometry_msgs::Quaternion | quaternionOgreToMsg (const Ogre::Quaternion &o) |
| bool | reloadShaders (std_srvs::Empty::Request &, std_srvs::Empty::Response &) |
| static void | removeMaterial (Ogre::MaterialPtr &material) |
| void | setAlphaBlending (const Ogre::MaterialPtr &mat) |
| void | setReplace (const Ogre::MaterialPtr &mat) |
| bool | validateFloats (const visualization_msgs::InteractiveMarker &msg) |
| bool | validateFloats (float val) |
| bool | validateFloats (double val) |
| bool | validateFloats (const Ogre::Vector3 &vec) |
| bool | validateFloats (const Ogre::Quaternion &quat) |
| bool | validateFloats (const geometry_msgs::PoseArray &msg) |
| bool | validateFloats (const sensor_msgs::CameraInfo &msg) |
| bool | validateFloats (const geometry_msgs::Point &msg) |
| bool | validateFloats (const geometry_msgs::PolygonStamped &msg) |
| bool | validateFloats (const geometry_msgs::Point32 &msg) |
| bool | validateFloats (const geometry_msgs::Vector3 &msg) |
| bool | validateFloats (const geometry_msgs::WrenchStamped &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) |
| bool | validateFloats (const nav_msgs::GridCells &msg) |
| template<typename T , size_t N> | |
| bool | validateFloats (const boost::array< T, N > &arr) |
| bool | validateFloats (const nav_msgs::Odometry &msg) |
| bool | validateFloats (const visualization_msgs::Marker &msg) |
| bool | validateFloats (const nav_msgs::Path &msg) |
| bool | validateFloats (const nav_msgs::OccupancyGrid &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 Ogre::Vector3 | vector3MsgToOgre (const geometry_msgs::Vector3 &m) |
| static void | vector3MsgToOgre (const geometry_msgs::Vector3 &m, Ogre::Vector3 &o) |
| static void | vector3OgreToMsg (const Ogre::Vector3 &o, geometry_msgs::Vector3 &m) |
| static geometry_msgs::Vector3 | vector3OgreToMsg (const Ogre::Vector3 &o) |
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 float | PITCH_LIMIT_HIGH = Ogre::Math::HALF_PI - 0.001 |
| static const float | PITCH_LIMIT_LOW = -Ogre::Math::HALF_PI + 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 uint32_t rviz::CollObjectHandle |
Definition at line 46 of file forwards.h.
| typedef boost::shared_ptr<FrameSelectionHandler> rviz::FrameSelectionHandlerPtr |
Definition at line 60 of file tf_display.h.
| typedef boost::shared_ptr<InteractiveObject> rviz::InteractiveObjectPtr |
Definition at line 59 of file interactive_object.h.
| typedef boost::weak_ptr<InteractiveObject> rviz::InteractiveObjectWPtr |
Definition at line 60 of file interactive_object.h.
| typedef boost::unordered_map<CollObjectHandle, Picked> rviz::M_Picked |
Definition at line 65 of file forwards.h.
| typedef boost::shared_ptr< MarkerBase > rviz::MarkerBasePtr |
Definition at line 56 of file interactive_marker_display.h.
| typedef std::pair< std::string, int32_t > rviz::MarkerID |
Definition at line 59 of file interactive_marker_display.h.
| typedef boost::shared_ptr<MarkerSelectionHandler> rviz::MarkerSelectionHandlerPtr |
Definition at line 58 of file marker_display.h.
| typedef boost::shared_ptr<PointCloudRenderable> rviz::PointCloudRenderablePtr |
Definition at line 85 of file point_cloud.h.
| typedef boost::shared_ptr<PointCloudSelectionHandler> rviz::PointCloudSelectionHandlerPtr |
Definition at line 70 of file point_cloud_common.h.
| typedef boost::shared_ptr<PointCloudTransformer> rviz::PointCloudTransformerPtr |
Definition at line 72 of file point_cloud_common.h.
| typedef boost::shared_ptr<PoseDisplaySelectionHandler> rviz::PoseDisplaySelectionHandlerPtr |
Definition at line 50 of file pose_display.h.
| typedef boost::shared_ptr<RobotLinkSelectionHandler> rviz::RobotLinkSelectionHandlerPtr |
Definition at line 76 of file robot_link.h.
| typedef std::set<CollObjectHandle> rviz::S_CollObject |
Definition at line 49 of file forwards.h.
| typedef std::set<FrameInfo*> rviz::S_FrameInfo |
Definition at line 159 of file tf_display.cpp.
| typedef std::set<JointInfo*> rviz::S_JointInfo |
Definition at line 672 of file effort_display.h.
| typedef std::set<Ogre::MaterialPtr> rviz::S_MaterialPtr |
Definition at line 57 of file marker_base.h.
Definition at line 184 of file selection_handler.h.
| typedef std::set<uint64_t> rviz::S_uint64 |
Definition at line 51 of file forwards.h.
| typedef boost::shared_ptr<SelectionHandler> rviz::SelectionHandlerPtr |
Definition at line 182 of file selection_handler.h.
Definition at line 83 of file status_property.h.
| typedef std::vector<Ogre::AxisAlignedBox> rviz::V_AABB |
Definition at line 60 of file selection_handler.h.
| typedef std::vector<CollObjectHandle> rviz::V_CollObject |
Definition at line 47 of file forwards.h.
| typedef std::vector<PointCloud::Point> rviz::V_PointCloudPoint |
Definition at line 56 of file point_cloud_transformer.h.
| typedef std::vector<PointCloudRenderablePtr> rviz::V_PointCloudRenderable |
Definition at line 86 of file point_cloud.h.
| typedef std::vector<SelectionHandlerPtr> rviz::V_SelectionHandler |
Definition at line 183 of file selection_handler.h.
| typedef std::vector< std::string > rviz::V_string |
Definition at line 673 of file effort_display.h.
| typedef std::vector<uint64_t> rviz::V_uint64 |
Definition at line 52 of file forwards.h.
| typedef std::vector<V_CollObject> rviz::VV_CollObject |
Definition at line 48 of file forwards.h.
| QString rviz::addSpaceToCamelCase | ( | QString | input | ) |
Definition at line 44 of file tool_manager.cpp.
| void rviz::applyVisibilityBits | ( | uint32_t | bits, |
| Ogre::SceneNode * | node | ||
| ) |
Definition at line 38 of file apply_visibility_bits.cpp.
| 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, | ||
| const float | scale, | ||
| std::vector< Ogre::MaterialPtr > & | material_table | ||
| ) |
Recursive mesh-building function.
| scene | is the assimp scene containing the whole mesh. |
| node | is the current assimp node, which is part of a tree of nodes being recursed over. |
| material_table | is indexed the same as scene->mMaterials[], and should have been filled out already by loadMaterials(). |
Definition at line 218 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 37 of file orthographic.cpp.
| void rviz::cleanupOgre | ( | ) |
Definition at line 14 of file initialization.cpp.
| uint32_t rviz::colorToHandle | ( | Ogre::PixelFormat | fmt, |
| uint32_t | col | ||
| ) | [inline] |
Definition at line 68 of file forwards.h.
| CollObjectHandle rviz::colorToHandle | ( | const Ogre::ColourValue & | color | ) | [inline] |
Definition at line 87 of file forwards.h.
| bool rviz::convertPointCloudToPointCloud2 | ( | const sensor_msgs::PointCloud & | input, |
| sensor_msgs::PointCloud2 & | output | ||
| ) |
Definition at line 877 of file point_cloud_common.cpp.
| void rviz::createColorMaterial | ( | const std::string & | name, |
| const Ogre::ColourValue & | color, | ||
| bool | use_self_illumination | ||
| ) |
Definition at line 275 of file visualization_manager.cpp.
| int32_t rviz::findChannelIndex | ( | const sensor_msgs::PointCloud2ConstPtr & | cloud, |
| const std::string & | channel | ||
| ) | [inline] |
Definition at line 48 of file point_cloud_transformers.h.
| QString rviz::findMaxCommonPrefix | ( | const QStringList & | strings | ) |
Definition at line 49 of file editable_combo_box.cpp.
| std::string rviz::get_distro | ( | ) |
| std::string rviz::get_ogre_plugin_path | ( | ) |
| std::string rviz::get_version | ( | ) |
| QCursor rviz::getDefaultCursor | ( | bool | fill_cache | ) |
Definition at line 97 of file load_resource.cpp.
| float rviz::getMeshUnitRescale | ( | const std::string & | resource_path | ) |
Definition at line 573 of file mesh_loader.cpp.
| boost::filesystem::path rviz::getPath | ( | QString | url | ) |
Definition at line 42 of file load_resource.cpp.
| void rviz::getPluginGroups | ( | const QMap< QString, QString > & | datatype_plugins, |
| QList< PluginGroup > * | groups, | ||
| QList< ros::master::TopicInfo > * | unvisualizable | ||
| ) |
Definition at line 116 of file add_display_dialog.cpp.
| bool rviz::getPointOnPlaneFromWindowXY | ( | Ogre::Viewport * | viewport, |
| Ogre::Plane & | plane, | ||
| int | window_x, | ||
| int | window_y, | ||
| Ogre::Vector3 & | intersection_out | ||
| ) |
Given a viewport and an x,y position in window-pixel coordinates, find the point on a plane directly behind it, if any.
Given a viewport and an x,y position in window-pixel coordinates, find the point on a plane directly behind it, if any.
Definition at line 44 of file geometry.cpp.
| static void rviz::getRainbowColor | ( | float | value, |
| Ogre::ColourValue & | color | ||
| ) | [static] |
Definition at line 46 of file point_cloud_transformers.cpp.
| std::string rviz::getTransformStatusName | ( | const std::string & | caller_id | ) |
Definition at line 319 of file frame_manager.cpp.
| void rviz::initializeResources | ( | const V_string & | resource_paths | ) |
Definition at line 21 of file initialization.cpp.
| bool rviz::isSubtopic | ( | const std::string & | base, |
| const std::string & | topic | ||
| ) |
Return true if one topic is a subtopic of the other.
A topic is a subtopic of another if a subset of its path exactly matches the other. For example, /camera/image_raw/compressed is a subtopic of /camera/image_raw but not /camera/image.
Definition at line 79 of file add_display_dialog.cpp.
| Ogre::ColourValue rviz::lerpColor | ( | const Ogre::ColourValue & | start, |
| const Ogre::ColourValue & | end, | ||
| float | t | ||
| ) |
Definition at line 490 of file tf_display.cpp.
| static int rviz::limit | ( | int | i | ) | [static] |
Definition at line 35 of file parse_color.cpp.
| void rviz::linkUpdaterStatusFunction | ( | StatusProperty::Level | level, |
| const std::string & | link_name, | ||
| const std::string & | text, | ||
| RobotModelDisplay * | display | ||
| ) |
Definition at line 49 of file robot_model_display.cpp.
| void rviz::loadMaterials | ( | const std::string & | resource_path, |
| const aiScene * | scene, | ||
| std::vector< Ogre::MaterialPtr > & | material_table_out | ||
| ) |
Load all materials needed by the given scene.
| resource_path | the path to the resource from which this scene is being loaded. loadMaterials() assumes textures for this scene are relative to the same directory that this scene is in. |
| scene | the assimp scene to load materials for. |
| material_table_out | Reference to the resultant material table, filled out by this function. Is indexed the same as scene->mMaterials[]. |
Definition at line 437 of file mesh_loader.cpp.
| Ogre::MeshPtr rviz::loadMeshFromResource | ( | const std::string & | resource_path | ) |
Definition at line 656 of file mesh_loader.cpp.
| QPixmap rviz::loadPixmap | ( | QString | url, |
| bool | fill_cache | ||
| ) |
Definition at line 66 of file load_resource.cpp.
| void rviz::loadTexture | ( | const std::string & | resource_path | ) |
Definition at line 391 of file mesh_loader.cpp.
| unsigned char* rviz::makeCostmapPalette | ( | ) |
Definition at line 166 of file map_display.cpp.
| QCursor rviz::makeIconCursor | ( | QString | url, |
| bool | fill_cache | ||
| ) |
Definition at line 102 of file load_resource.cpp.
| QCursor rviz::makeIconCursor | ( | QPixmap | icon, |
| QString | cache_key, | ||
| bool | fill_cache | ||
| ) |
Definition at line 114 of file load_resource.cpp.
| unsigned char* rviz::makeMapPalette | ( | ) |
Definition at line 128 of file map_display.cpp.
| Ogre::TexturePtr rviz::makePaletteTexture | ( | unsigned char * | palette_bytes | ) |
Definition at line 237 of file map_display.cpp.
| unsigned char* rviz::makeRawPalette | ( | ) |
Definition at line 221 of file map_display.cpp.
| float rviz::mapAngleTo0_2Pi | ( | float | angle | ) |
Return the input angle mapped back to the range 0 to 2*PI.
Definition at line 64 of file geometry.cpp.
| Ogre::MeshPtr rviz::meshFromAssimpScene | ( | const std::string & | name, |
| const aiScene * | scene | ||
| ) |
Definition at line 629 of file mesh_loader.cpp.
| static Display* rviz::newDisplayGroup | ( | ) | [static] |
Definition at line 39 of file display_factory.cpp.
| static Panel* rviz::newDisplaysPanel | ( | ) | [static] |
Definition at line 42 of file panel_factory.cpp.
| static Panel* rviz::newHelpPanel | ( | ) | [static] |
Definition at line 43 of file panel_factory.cpp.
| static Panel* rviz::newSelectionPanel | ( | ) | [static] |
Definition at line 44 of file panel_factory.cpp.
| static Panel* rviz::newTimePanel | ( | ) | [static] |
Definition at line 45 of file panel_factory.cpp.
| static Panel* rviz::newToolPropertiesPanel | ( | ) | [static] |
Definition at line 46 of file panel_factory.cpp.
| static Panel* rviz::newViewsPanel | ( | ) | [static] |
Definition at line 47 of file panel_factory.cpp.
| QColor rviz::ogreToQt | ( | const Ogre::ColourValue & | c | ) |
Definition at line 82 of file parse_color.cpp.
| bool rviz::operator== | ( | IndexAndMessage | a, |
| IndexAndMessage | b | ||
| ) |
Definition at line 79 of file point_cloud_common.cpp.
| QColor rviz::parseColor | ( | const QString & | color_string | ) |
Definition at line 44 of file parse_color.cpp.
| Ogre::Vector3 rviz::pointFromCloud | ( | const sensor_msgs::PointCloud2ConstPtr & | cloud, |
| uint32_t | index | ||
| ) |
Definition at line 131 of file point_cloud_common.cpp.
| static Ogre::Vector3 rviz::pointMsgToOgre | ( | const geometry_msgs::Point & | m | ) | [inline, static] |
Definition at line 44 of file msg_conversions.h.
| static void rviz::pointMsgToOgre | ( | const geometry_msgs::Point & | m, |
| Ogre::Vector3 & | o | ||
| ) | [inline, static] |
Definition at line 49 of file msg_conversions.h.
| static void rviz::pointOgreToMsg | ( | const Ogre::Vector3 & | o, |
| geometry_msgs::Point & | m | ||
| ) | [inline, static] |
Definition at line 78 of file msg_conversions.h.
| static geometry_msgs::Point rviz::pointOgreToMsg | ( | const Ogre::Vector3 & | o | ) | [inline, static] |
Definition at line 83 of file msg_conversions.h.
| QString rviz::printColor | ( | const QColor & | color | ) |
Definition at line 74 of file parse_color.cpp.
| Ogre::Vector2 rviz::project3DPointToViewportXY | ( | const Ogre::Viewport * | view, |
| const Ogre::Vector3 & | pos | ||
| ) |
Given a viewport and a 3D position in world coordinates, project that point into the view plane.
Definition at line 75 of file geometry.cpp.
| uint rviz::qHash | ( | IndexAndMessage | iam | ) |
Definition at line 71 of file point_cloud_common.cpp.
| Ogre::ColourValue rviz::qtToOgre | ( | const QColor & | c | ) |
Definition at line 87 of file parse_color.cpp.
| static Ogre::Quaternion rviz::quaternionMsgToOgre | ( | const geometry_msgs::Quaternion & | m | ) | [inline, static] |
Definition at line 67 of file msg_conversions.h.
| static void rviz::quaternionMsgToOgre | ( | const geometry_msgs::Quaternion & | m, |
| Ogre::Quaternion & | o | ||
| ) | [inline, static] |
Definition at line 72 of file msg_conversions.h.
| static void rviz::quaternionOgreToMsg | ( | const Ogre::Quaternion & | o, |
| geometry_msgs::Quaternion & | m | ||
| ) | [inline, static] |
Definition at line 104 of file msg_conversions.h.
| static geometry_msgs::Quaternion rviz::quaternionOgreToMsg | ( | const Ogre::Quaternion & | o | ) | [inline, static] |
Definition at line 109 of file msg_conversions.h.
| bool rviz::reloadShaders | ( | std_srvs::Empty::Request & | , |
| std_srvs::Empty::Response & | |||
| ) |
Definition at line 67 of file visualizer_app.cpp.
| static void rviz::removeMaterial | ( | Ogre::MaterialPtr & | material | ) | [static] |
Definition at line 171 of file point_cloud.cpp.
| void rviz::setAlphaBlending | ( | const Ogre::MaterialPtr & | mat | ) |
Definition at line 396 of file point_cloud.cpp.
| void rviz::setReplace | ( | const Ogre::MaterialPtr & | mat | ) |
Definition at line 405 of file point_cloud.cpp.
| bool rviz::validateFloats | ( | const visualization_msgs::InteractiveMarker & | msg | ) |
Definition at line 46 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 Ogre::Quaternion & | quat | ) | [inline] |
Definition at line 68 of file validate_floats.h.
| bool rviz::validateFloats | ( | const geometry_msgs::PoseArray & | msg | ) |
Definition at line 68 of file pose_array_display.cpp.
| bool rviz::validateFloats | ( | const sensor_msgs::CameraInfo & | msg | ) |
Definition at line 71 of file camera_display.cpp.
| bool rviz::validateFloats | ( | const geometry_msgs::Point & | msg | ) | [inline] |
Definition at line 78 of file validate_floats.h.
| bool rviz::validateFloats | ( | const geometry_msgs::PolygonStamped & | msg | ) |
Definition at line 80 of file polygon_display.cpp.
| 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::WrenchStamped & | msg | ) |
Definition at line 105 of file wrench_display.cpp.
| 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 nav_msgs::GridCells & | msg | ) |
Definition at line 168 of file grid_cells_display.cpp.
| 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::Odometry & | msg | ) |
Definition at line 198 of file odometry_display.cpp.
| bool rviz::validateFloats | ( | const visualization_msgs::Marker & | msg | ) |
Definition at line 284 of file marker_display.cpp.
| bool rviz::validateFloats | ( | const nav_msgs::Path & | msg | ) |
Definition at line 389 of file path_display.cpp.
| bool rviz::validateFloats | ( | const nav_msgs::OccupancyGrid & | msg | ) |
Definition at line 475 of file map_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 62 of file point_cloud_transformers.h.
| static Ogre::Vector3 rviz::vector3MsgToOgre | ( | const geometry_msgs::Vector3 & | m | ) | [inline, static] |
Definition at line 55 of file msg_conversions.h.
| static void rviz::vector3MsgToOgre | ( | const geometry_msgs::Vector3 & | m, |
| Ogre::Vector3 & | o | ||
| ) | [inline, static] |
Definition at line 61 of file msg_conversions.h.
| static void rviz::vector3OgreToMsg | ( | const Ogre::Vector3 & | o, |
| geometry_msgs::Vector3 & | m | ||
| ) | [inline, static] |
Definition at line 91 of file msg_conversions.h.
| static geometry_msgs::Vector3 rviz::vector3OgreToMsg | ( | const Ogre::Vector3 & | o | ) | [inline, static] |
Definition at line 96 of file msg_conversions.h.
static const float rviz::CAMERA_OFFSET = 0.2 [static] |
Definition at line 55 of file third_person_follower_view_controller.cpp.
float rviz::g_billboard_sphere_vertices[3 *3] [static] |
{
0.0f, 1.0f, 0.0f,
-0.866025404f, -0.5f, 0.0f,
0.866025404f, -0.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.
static const float rviz::PITCH_LIMIT_HIGH = Ogre::Math::HALF_PI - 0.001 [static] |
Definition at line 55 of file fps_view_controller.cpp.
static const float rviz::PITCH_LIMIT_LOW = -Ogre::Math::HALF_PI + 0.001 [static] |
Definition at line 54 of file fps_view_controller.cpp.
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 50 of file fps_view_controller.cpp.
bool rviz::x_baddrawable_error = false [static] |
Definition at line 326 of file render_system.cpp.
const float rviz::YAW_START = Ogre::Math::PI [static] |
Definition at line 50 of file orbit_camera.cpp.