Namespaces | Classes | Typedefs | Enumerations | Functions | Variables
moveit_rviz_plugin Namespace Reference

Namespaces

 detail
 
 icons
 
 utils
 

Classes

class  BaseTaskModel
 
class  DisplaySolution
 
class  FactoryModel
 
class  GlobalSettingsWidget
 
class  GlobalSettingsWidgetPrivate
 
class  JMGItemModel
 
class  JogSlider
 
class  JointsWidgetEventFilter
 
class  LocalTaskModel
 
class  MarkerVisualization
 
class  MarkerVisualizationProperty
 
class  MetaTaskListModel
 
class  MotionPlanningDisplay
 
class  MotionPlanningFrame
 
class  MotionPlanningFrameJointsWidget
 
class  MotionPlanningParamWidget
 
class  OcTreeRender
 
class  PlanningLinkUpdater
 
class  PlanningSceneDisplay
 
class  PlanningSceneRender
 
class  PluginlibFactory
 
class  ProgressBarDelegate
 
class  PropertyFactory
 
class  RemoteSolutionModel
 
class  RemoteTaskModel
 
class  RenderShapes
 
class  RobotStateDisplay
 
class  RobotStateVisualization
 
class  SolutionListView
 
class  SubPanel
 Base class for all sub panels within the Task Panel. More...
 
class  TaskDisplay
 
class  TaskListModel
 
class  TaskListView
 
class  TaskPanel
 
class  TaskPanelPrivate
 
class  TaskSolutionPanel
 
class  TaskSolutionVisualization
 
class  TaskView
 
class  TaskViewPrivate
 
class  TrajectoryDisplay
 
class  TrajectoryPanel
 
class  TrajectoryVisualization
 

Typedefs

using NodeFlags = QFlags< NodeFlag >
 
using StageFactory = PluginlibFactory< moveit::task_constructor::Stage >
 
using StageFactoryPtr = std::shared_ptr< StageFactory >
 
typedef std::vector< rviz::PointCloud::PointVPoint
 
typedef std::vector< VPointVVPoint
 

Enumerations

enum  NodeFlag : uint8_t { WAS_VISITED = 0x01, NAME_CHANGED = 0x02 }
 
enum  OctreeVoxelColorMode
 
enum  OctreeVoxelRenderMode
 

Functions

static QString decideStatusText (const collision_detection::CollisionEnv::ObjectConstPtr &obj)
 
static QString decideStatusText (const moveit::core::AttachedBody *attached_body)
 
static Eigen::Index findMatching (const Eigen::VectorXd &key, const Eigen::MatrixXd &haystack, const Eigen::VectorXi &available, double &sign)
 
template<typename T >
static rviz::FloatPropertyfloatFactory (const QString &name, mtc::Property &mtc_prop, const planning_scene::PlanningScene *, rviz::DisplayContext *)
 
rviz::PanelDockWidgetgetStageDockWidget (rviz::WindowManagerInterface *mgr)
 
StageFactoryPtr getStageFactory ()
 
static bool hasChild (rviz::Property *root, const QString &name)
 
static const std::string LOGNAME ("TaskListModel")
 
 MOVEIT_CLASS_FORWARD (BaseTaskModel)
 
 MOVEIT_CLASS_FORWARD (DisplaySolution)
 
 MOVEIT_CLASS_FORWARD (MarkerVisualization)
 
 MOVEIT_CLASS_FORWARD (OcTreeRender)
 
 MOVEIT_CLASS_FORWARD (PlanningSceneRender)
 
 MOVEIT_CLASS_FORWARD (RemoteTaskModel)
 
 MOVEIT_CLASS_FORWARD (RenderShapes)
 
 MOVEIT_CLASS_FORWARD (RobotStateVisualization)
 
 MOVEIT_CLASS_FORWARD (TaskDisplay)
 
 MOVEIT_CLASS_FORWARD (TaskListModel)
 
 MOVEIT_CLASS_FORWARD (TaskPanel)
 
 MOVEIT_CLASS_FORWARD (TaskSolutionVisualization)
 
 MOVEIT_CLASS_FORWARD (TrajectoryVisualization)
 
static bool operator!= (const std_msgs::ColorRGBA &a, const std_msgs::ColorRGBA &b)
 
void setExpanded (QTreeView *view, const QModelIndex &index, bool expand, int depth=-1)
 
void setVisibility (Ogre::SceneNode *node, Ogre::SceneNode *parent, bool visible)
 
static rviz::StringPropertystringFactory (const QString &name, mtc::Property &mtc_prop, const planning_scene::PlanningScene *, rviz::DisplayContext *)
 
bool try_lexical_convert (const QString &value, double &dvalue)
 
bool try_lexical_convert (const QString &value, long &lvalue)
 

Variables

static uint DISPLAY_COUNT = 0
 
static const double LARGE_MESH_THRESHOLD
 
const std::string OBJECT_RECOGNITION_ACTION
 
 OCTOMAP_FREE_VOXELS
 
 OCTOMAP_OCCUPIED_VOXELS
 
 OCTOMAP_PROBABLILTY_COLOR
 
 OCTOMAP_Z_AXIS_COLOR
 
static QPointer< TaskPanelSINGLETON
 
static const std::string TAB_CONTEXT
 
static const std::string TAB_MANIPULATION
 
static const std::string TAB_OBJECTS
 
static const std::string TAB_PLANNING
 
static const std::string TAB_SCENES
 
static const std::string TAB_STATES
 
static const std::string TAB_STATUS
 

Typedef Documentation

◆ NodeFlags

using moveit_rviz_plugin::NodeFlags = typedef QFlags<NodeFlag>

Definition at line 62 of file remote_task_model.cpp.

◆ StageFactory

Definition at line 65 of file task_list_model.h.

◆ StageFactoryPtr

using moveit_rviz_plugin::StageFactoryPtr = typedef std::shared_ptr<StageFactory>

Definition at line 66 of file task_list_model.h.

Enumeration Type Documentation

◆ NodeFlag

Enumerator
WAS_VISITED 
NAME_CHANGED 

Definition at line 57 of file remote_task_model.cpp.

Function Documentation

◆ floatFactory()

template<typename T >
static rviz::FloatProperty* moveit_rviz_plugin::floatFactory ( const QString &  name,
mtc::Property mtc_prop,
const planning_scene::PlanningScene ,
rviz::DisplayContext  
)
static

Definition at line 96 of file property_factory.cpp.

◆ getStageDockWidget()

rviz::PanelDockWidget* moveit_rviz_plugin::getStageDockWidget ( rviz::WindowManagerInterface mgr)

Definition at line 96 of file task_panel.cpp.

◆ getStageFactory()

StageFactoryPtr moveit_rviz_plugin::getStageFactory ( )

Definition at line 135 of file task_list_model.cpp.

◆ hasChild()

static bool moveit_rviz_plugin::hasChild ( rviz::Property root,
const QString &  name 
)
static

Definition at line 155 of file property_factory.cpp.

◆ LOGNAME()

static const std::string moveit_rviz_plugin::LOGNAME ( "TaskListModel"  )
static

◆ MOVEIT_CLASS_FORWARD() [1/8]

moveit_rviz_plugin::MOVEIT_CLASS_FORWARD ( BaseTaskModel  )

◆ MOVEIT_CLASS_FORWARD() [2/8]

moveit_rviz_plugin::MOVEIT_CLASS_FORWARD ( DisplaySolution  )

◆ MOVEIT_CLASS_FORWARD() [3/8]

moveit_rviz_plugin::MOVEIT_CLASS_FORWARD ( MarkerVisualization  )

◆ MOVEIT_CLASS_FORWARD() [4/8]

moveit_rviz_plugin::MOVEIT_CLASS_FORWARD ( RemoteTaskModel  )

◆ MOVEIT_CLASS_FORWARD() [5/8]

moveit_rviz_plugin::MOVEIT_CLASS_FORWARD ( TaskDisplay  )

◆ MOVEIT_CLASS_FORWARD() [6/8]

moveit_rviz_plugin::MOVEIT_CLASS_FORWARD ( TaskListModel  )

◆ MOVEIT_CLASS_FORWARD() [7/8]

moveit_rviz_plugin::MOVEIT_CLASS_FORWARD ( TaskPanel  )

◆ MOVEIT_CLASS_FORWARD() [8/8]

moveit_rviz_plugin::MOVEIT_CLASS_FORWARD ( TaskSolutionVisualization  )

◆ setExpanded()

void moveit_rviz_plugin::setExpanded ( QTreeView *  view,
const QModelIndex &  index,
bool  expand,
int  depth = -1 
)

Definition at line 243 of file task_panel.cpp.

◆ setVisibility()

void moveit_rviz_plugin::setVisibility ( Ogre::SceneNode *  node,
Ogre::SceneNode *  parent,
bool  visible 
)

Definition at line 47 of file marker_visualization.cpp.

◆ stringFactory()

static rviz::StringProperty* moveit_rviz_plugin::stringFactory ( const QString &  name,
mtc::Property mtc_prop,
const planning_scene::PlanningScene ,
rviz::DisplayContext  
)
static

Definition at line 83 of file property_factory.cpp.

Variable Documentation

◆ DISPLAY_COUNT

uint moveit_rviz_plugin::DISPLAY_COUNT = 0
static

Definition at line 116 of file task_panel.cpp.

◆ SINGLETON

QPointer<TaskPanel> moveit_rviz_plugin::SINGLETON
static

Definition at line 114 of file task_panel.cpp.



visualization
Author(s): Robert Haschke
autogenerated on Thu Feb 27 2025 03:39:51