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

Classes

class  JMGItemModel
 
class  JogSlider
 Slider that jumps back to zero. More...
 
class  JointsWidgetEventFilter
 
class  MotionPlanningDisplay
 
class  MotionPlanningFrame
 
class  MotionPlanningFrameJointsWidget
 
class  MotionPlanningParamWidget
 
class  OcTreeRender
 
class  PlanningLinkUpdater
 Update the links of an rviz::Robot using a moveit::core::RobotState. More...
 
class  PlanningSceneDisplay
 
class  PlanningSceneRender
 
class  ProgressBarDelegate
 Delegate to show the joint value as with a progress bar indicator between min and max. More...
 
class  RenderShapes
 
class  RobotStateDisplay
 
class  RobotStateVisualization
 Update the links of an rviz::Robot using a moveit::core::RobotState. More...
 
class  TrajectoryDisplay
 
class  TrajectoryPanel
 
class  TrajectoryVisualization
 

Typedefs

typedef std::vector< rviz::PointCloud::PointVPoint
 
typedef std::vector< VPointVVPoint
 

Enumerations

enum  OctreeVoxelColorMode { OCTOMAP_Z_AXIS_COLOR, OCTOMAP_PROBABLILTY_COLOR }
 
enum  OctreeVoxelRenderMode { OCTOMAP_FREE_VOXELS = 1, OCTOMAP_OCCUPIED_VOXELS = 2 }
 

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)
 
 MOVEIT_CLASS_FORWARD (OcTreeRender)
 
 MOVEIT_CLASS_FORWARD (PlanningSceneRender)
 
 MOVEIT_CLASS_FORWARD (RenderShapes)
 
 MOVEIT_CLASS_FORWARD (RobotStateVisualization)
 
 MOVEIT_CLASS_FORWARD (TrajectoryVisualization)
 
static bool operator!= (const std_msgs::ColorRGBA &a, const std_msgs::ColorRGBA &b)
 
bool try_lexical_convert (const QString &value, double &dvalue)
 
bool try_lexical_convert (const QString &value, long &lvalue)
 

Variables

static const double LARGE_MESH_THRESHOLD = 10.0
 
const std::string OBJECT_RECOGNITION_ACTION = "/recognize_objects"
 
static const std::string TAB_CONTEXT = "Context"
 
static const std::string TAB_MANIPULATION = "Manipulation"
 
static const std::string TAB_OBJECTS = "Scene Objects"
 
static const std::string TAB_PLANNING = "Planning"
 
static const std::string TAB_SCENES = "Stored Scenes"
 
static const std::string TAB_STATES = "Stored States"
 
static const std::string TAB_STATUS = "Status"
 

Typedef Documentation

◆ VPoint

Definition at line 81 of file octomap_render.cpp.

◆ VVPoint

typedef std::vector<VPoint> moveit_rviz_plugin::VVPoint

Definition at line 82 of file octomap_render.cpp.

Enumeration Type Documentation

◆ OctreeVoxelColorMode

Enumerator
OCTOMAP_Z_AXIS_COLOR 
OCTOMAP_PROBABLILTY_COLOR 

Definition at line 58 of file octomap_render.h.

◆ OctreeVoxelRenderMode

Enumerator
OCTOMAP_FREE_VOXELS 
OCTOMAP_OCCUPIED_VOXELS 

Definition at line 52 of file octomap_render.h.

Function Documentation

◆ decideStatusText() [1/2]

static QString moveit_rviz_plugin::decideStatusText ( const collision_detection::CollisionEnv::ObjectConstPtr obj)
static

Definition at line 242 of file motion_planning_frame_objects.cpp.

◆ decideStatusText() [2/2]

static QString moveit_rviz_plugin::decideStatusText ( const moveit::core::AttachedBody attached_body)
static

Definition at line 269 of file motion_planning_frame_objects.cpp.

◆ findMatching()

static Eigen::Index moveit_rviz_plugin::findMatching ( const Eigen::VectorXd key,
const Eigen::MatrixXd &  haystack,
const Eigen::VectorXi &  available,
double &  sign 
)
static

Definition at line 353 of file motion_planning_frame_joints_widget.cpp.

◆ MOVEIT_CLASS_FORWARD() [1/5]

moveit_rviz_plugin::MOVEIT_CLASS_FORWARD ( OcTreeRender  )

◆ MOVEIT_CLASS_FORWARD() [2/5]

moveit_rviz_plugin::MOVEIT_CLASS_FORWARD ( PlanningSceneRender  )

◆ MOVEIT_CLASS_FORWARD() [3/5]

moveit_rviz_plugin::MOVEIT_CLASS_FORWARD ( RenderShapes  )

◆ MOVEIT_CLASS_FORWARD() [4/5]

moveit_rviz_plugin::MOVEIT_CLASS_FORWARD ( RobotStateVisualization  )

◆ MOVEIT_CLASS_FORWARD() [5/5]

moveit_rviz_plugin::MOVEIT_CLASS_FORWARD ( TrajectoryVisualization  )

◆ operator!=()

static bool moveit_rviz_plugin::operator!= ( const std_msgs::ColorRGBA &  a,
const std_msgs::ColorRGBA &  b 
)
static

Definition at line 221 of file robot_state_display.cpp.

◆ try_lexical_convert() [1/2]

bool moveit_rviz_plugin::try_lexical_convert ( const QString &  value,
double &  dvalue 
)

Definition at line 112 of file motion_planning_param_widget.cpp.

◆ try_lexical_convert() [2/2]

bool moveit_rviz_plugin::try_lexical_convert ( const QString &  value,
long &  lvalue 
)

Definition at line 105 of file motion_planning_param_widget.cpp.

Variable Documentation

◆ LARGE_MESH_THRESHOLD

const double moveit_rviz_plugin::LARGE_MESH_THRESHOLD = 10.0
static

Definition at line 96 of file motion_planning_frame.h.

◆ OBJECT_RECOGNITION_ACTION

const std::string moveit_rviz_plugin::OBJECT_RECOGNITION_ACTION = "/recognize_objects"

Definition at line 86 of file motion_planning_frame.h.

◆ TAB_CONTEXT

const std::string moveit_rviz_plugin::TAB_CONTEXT = "Context"
static

Definition at line 88 of file motion_planning_frame.h.

◆ TAB_MANIPULATION

const std::string moveit_rviz_plugin::TAB_MANIPULATION = "Manipulation"
static

Definition at line 90 of file motion_planning_frame.h.

◆ TAB_OBJECTS

const std::string moveit_rviz_plugin::TAB_OBJECTS = "Scene Objects"
static

Definition at line 91 of file motion_planning_frame.h.

◆ TAB_PLANNING

const std::string moveit_rviz_plugin::TAB_PLANNING = "Planning"
static

Definition at line 89 of file motion_planning_frame.h.

◆ TAB_SCENES

const std::string moveit_rviz_plugin::TAB_SCENES = "Stored Scenes"
static

Definition at line 92 of file motion_planning_frame.h.

◆ TAB_STATES

const std::string moveit_rviz_plugin::TAB_STATES = "Stored States"
static

Definition at line 93 of file motion_planning_frame.h.

◆ TAB_STATUS

const std::string moveit_rviz_plugin::TAB_STATUS = "Status"
static

Definition at line 94 of file motion_planning_frame.h.



visualization
Author(s): Ioan Sucan , Dave Coleman , Sachin Chitta
autogenerated on Thu Feb 27 2025 03:29:15