Overview

This node belongs to the PTAM package of the ETHZASL_PTAM stack. It is a tool to display the 3D point cloud, keyframes and current camera pose and path in RViz and to save this information to a text file for later processing.

Usage

The node displays the information right after its start. Use the dynamic_reconfigure GUI to manage the information to be displayed in RViz and to store the data in text files. Note that only the point cloud of the current map in PTAM is displayed. If you only keep a few KFs in the map but still want to display all previously acquired map points, set the marker decay time in RViz to a higher value.

Node Information

ptam_visualizer

node to save and display the PTAM information such as the 3D point cloud, keyframes and current camera pose and path in RViz

Subscribed Topics

vslam/pose (geometry_msgs/PoseWithCovarianceStamped)

Published Topics

vslam/path_visualization (visualization_msgs/Marker)
  • line marker for RViz to display the 3D path of the camera
vslam/kf_visualization_array (visualization_msgs/MarkerArray)
  • marker array for RViz to display KF tripods
vslam/kfs (visualization_msgs/MarkerArray) vslam/pc2 (sensor_msgs/PointCloud2)
  • PointCloud2 containing the current 3D map points of PTAM

Parameters

Dynamically Reconfigurable Parameters
See the dynamic_reconfigure package for details on dynamically reconfigurable parameters.
~ShowPC (bool, default: True)
  • Show point cloud
~ShowAllKFs (bool, default: True)
  • Show all keyframes ever made
~ShowKFs (bool, default: True)
  • Show keyframes
~KFLifetime (int, default: 1)
  • KF lifetime in sec Range: 1 to 60000
~ShowPath (bool, default: True)
  • Show path
~PathLength (int, default: 1000)
  • Number of path anchor points Range: 1 to 60000
~ExportPC (bool, default: False)
  • export point cloud to file
~ExportPrefix (str, default: )
  • prefix for export to file
~SaveMap (bool, default: False)
  • save full map to file
~KFFlags (int, default: 0)
  • 0:get all KFs, <0: get N newest KFs, 1: get new KFs only Range: -100 to 1

Wiki: ethzasl_ptam/ptam/ptam_visualizer (last edited 2012-05-02 01:46:43 by stephanweiss)