-
Notifications
You must be signed in to change notification settings - Fork 9
Home
Sarathkrishnan Ramesh edited this page Sep 1, 2020
·
4 revisions
RViz is a 3D visualization tool for robots using ROS.
Ignition RViz offers functionality similar to RViz, and is developed using Ignition libraries.
As of now the following display plugins are supported in ign-rviz:
Name | Description |
---|---|
Global Options | Configure global options like changing fixed frame and scene background color. |
Axes | Renders an axis at the origin of the target frame |
Image | Displays Image received as sensor_msgs::msg::Image ROS message |
LaserScan | Renders data from sensor_msgs::msg::LaserScan message as points in the world, drawn as points, rays and triangles |
Path | Renders data from nav_msgs::msg::Path message as lines, arrows or axes |
PointStamped | Renders data from geometry_msgs::msg::PointStamped message as spheres |
Polygon | Renders data from geometry_msgs::msg::PolygonStamped message as lines |
Pose | Renders data from geometry_msgs::msg::PoseStamped message as arrows or axes |
PoseArray | Renders data from geometry_msgs::msg::PoseArray message as arrows or axes |
RobotModel | RobotModelDisplay plugin renders robot model in the correct pose as defined by current TF transforms |
TF | Displays the robot TF transform hierarchy |