#include <mock_context.h>
Public Member Functions | |
virtual uint32_t | getDefaultVisibilityBit () const |
virtual DisplayFactory * | getDisplayFactory () const |
Return a factory for creating Display subclasses based on a class id string. More... | |
virtual QString | getFixedFrame () const |
Return the fixed frame name. More... | |
virtual uint64_t | getFrameCount () const |
Return the current value of the frame count. More... | |
virtual FrameManager * | getFrameManager () const |
Return the FrameManager instance. More... | |
virtual DisplayGroup * | getRootDisplayGroup () const |
virtual Ogre::SceneManager * | getSceneManager () const |
Returns the Ogre::SceneManager used for the main RenderPanel. More... | |
virtual SelectionManager * | getSelectionManager () const |
Return a pointer to the SelectionManager. More... | |
virtual ros::CallbackQueueInterface * | getThreadedQueue () |
Return a CallbackQueue using a different thread than the main GUI one. More... | |
virtual ToolManager * | getToolManager () const |
Return the ToolManager. More... | |
virtual ros::CallbackQueueInterface * | getUpdateQueue () |
Return the CallbackQueue using the main GUI thread. More... | |
virtual ViewManager * | getViewManager () const |
Return the ViewManager. More... | |
virtual WindowManagerInterface * | getWindowManager () const |
Return the window manager, if any. More... | |
virtual void | handleChar (QKeyEvent *event, RenderPanel *panel) |
Handle a single key event for a given RenderPanel. More... | |
virtual void | handleMouseEvent (const ViewportMouseEvent &event) |
Handle a mouse event. More... | |
MockContext () | |
virtual void | queueRender () |
Queues a render. Multiple calls before a render happens will only cause a single render. More... | |
virtual void | setStatus (const QString &message) |
virtual BitAllocator * | visibilityBits () |
Public Member Functions inherited from rviz::DisplayContext | |
std::shared_ptr< tf2_ros::Buffer > | getTF2BufferPtr () const |
Convenience function: returns getFrameManager()->getTF2BufferPtr(). More... | |
Private Attributes | |
DisplayFactory * | display_factory_ |
Additional Inherited Members | |
Public Slots inherited from rviz::DisplayContext |
Definition at line 36 of file mock_context.h.
rviz::MockContext::MockContext | ( | ) |
Definition at line 36 of file mock_context.cpp.
|
inlinevirtual |
Implements rviz::DisplayContext.
Definition at line 95 of file mock_context.h.
|
inlinevirtual |
Return a factory for creating Display subclasses based on a class id string.
Implements rviz::DisplayContext.
Definition at line 65 of file mock_context.h.
|
inlinevirtual |
Return the fixed frame name.
Implements rviz::DisplayContext.
Definition at line 57 of file mock_context.h.
|
inlinevirtual |
Return the current value of the frame count.
The frame count is just a number which increments each time a frame is rendered. This lets clients check if a new frame has been rendered since the last time they did something.
Implements rviz::DisplayContext.
Definition at line 61 of file mock_context.h.
|
inlinevirtual |
Return the FrameManager instance.
Implements rviz::DisplayContext.
Definition at line 53 of file mock_context.h.
|
inlinevirtual |
Implements rviz::DisplayContext.
Definition at line 91 of file mock_context.h.
|
inlinevirtual |
Returns the Ogre::SceneManager used for the main RenderPanel.
Implements rviz::DisplayContext.
Definition at line 41 of file mock_context.h.
|
inlinevirtual |
Return a pointer to the SelectionManager.
Implements rviz::DisplayContext.
Definition at line 49 of file mock_context.h.
|
inlinevirtual |
Return a CallbackQueue using a different thread than the main GUI one.
Implements rviz::DisplayContext.
Definition at line 73 of file mock_context.h.
|
inlinevirtual |
Return the ToolManager.
Implements rviz::DisplayContext.
Definition at line 83 of file mock_context.h.
|
inlinevirtual |
Return the CallbackQueue using the main GUI thread.
Implements rviz::DisplayContext.
Definition at line 69 of file mock_context.h.
|
inlinevirtual |
Return the ViewManager.
Implements rviz::DisplayContext.
Definition at line 87 of file mock_context.h.
|
inlinevirtual |
Return the window manager, if any.
Implements rviz::DisplayContext.
Definition at line 45 of file mock_context.h.
|
inlinevirtual |
Handle a single key event for a given RenderPanel.
Implements rviz::DisplayContext.
Definition at line 77 of file mock_context.h.
|
inlinevirtual |
Handle a mouse event.
Implements rviz::DisplayContext.
Definition at line 80 of file mock_context.h.
|
inlinevirtual |
Queues a render. Multiple calls before a render happens will only cause a single render.
Implements rviz::DisplayContext.
Definition at line 107 of file mock_context.h.
|
inlinevirtual |
Set the message displayed in the status bar
Implements rviz::DisplayContext.
Definition at line 103 of file mock_context.h.
|
inlinevirtual |
Implements rviz::DisplayContext.
Definition at line 99 of file mock_context.h.
|
private |
Definition at line 112 of file mock_context.h.