#include <ros/ros.h>#include <ptam_com/PointCloud.h>#include <ptam_com/KeyFrame_srv.h>#include <ptam_com/KeyFrame_msg.h>#include <sensor_msgs/PointCloud2.h>#include <ptam/PTAMVisualizerParamsConfig.h>#include <dynamic_reconfigure/server.h>#include <visualization_msgs/Marker.h>#include <ptam/AxesArray.h>#include <unistd.h>#include <sys/types.h>#include <pwd.h>
Go to the source code of this file.
Typedefs | |
| typedef dynamic_reconfigure::Server < ptam::PTAMVisualizerParamsConfig > | ReconfigureServer |
Functions | |
| void | Config (ptam::PTAMVisualizerParamsConfig &config, uint32_t level) |
| void | exportPC (std::string prefix) |
| int | main (int argc, char **argv) |
| void | pathCallback (const geometry_msgs::PoseWithCovarianceStampedConstPtr &msg) |
| void | saveMap (std::string prefix) |
Variables | |
| unsigned int | kf_lifetime_ |
| int | KFFlags_ |
| unsigned int | lastKFid |
| visualization_msgs::Marker | path |
| unsigned int | path_length_ |
| sensor_msgs::PointCloud2 * | pPC2 |
| ros::Publisher | pub_path |
| struct passwd * | pw |
| ReconfigureServer * | reconfServer_ |
| bool | show_all_kfs_ |
| bool | show_kfs_ |
| bool | show_path_ |
| bool | show_pc_ |
| AxesArray | tripods |
| AxesArray | tripodshistory |
| typedef dynamic_reconfigure::Server<ptam::PTAMVisualizerParamsConfig> ReconfigureServer |
Definition at line 16 of file PTAMVisualizer.cpp.
| void Config | ( | ptam::PTAMVisualizerParamsConfig & | config, |
| uint32_t | level | ||
| ) |
Definition at line 245 of file PTAMVisualizer.cpp.
| void exportPC | ( | std::string | prefix | ) |
Definition at line 163 of file PTAMVisualizer.cpp.
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 40 of file PTAMVisualizer.cpp.
| void pathCallback | ( | const geometry_msgs::PoseWithCovarianceStampedConstPtr & | msg | ) |
Definition at line 147 of file PTAMVisualizer.cpp.
| void saveMap | ( | std::string | prefix | ) |
Definition at line 192 of file PTAMVisualizer.cpp.
| unsigned int kf_lifetime_ |
Definition at line 23 of file PTAMVisualizer.cpp.
| int KFFlags_ |
Definition at line 28 of file PTAMVisualizer.cpp.
| unsigned int lastKFid |
Definition at line 29 of file PTAMVisualizer.cpp.
| visualization_msgs::Marker path |
Definition at line 30 of file PTAMVisualizer.cpp.
| unsigned int path_length_ |
Definition at line 25 of file PTAMVisualizer.cpp.
| sensor_msgs::PointCloud2* pPC2 |
Definition at line 26 of file PTAMVisualizer.cpp.
Definition at line 31 of file PTAMVisualizer.cpp.
| struct passwd* pw |
Definition at line 27 of file PTAMVisualizer.cpp.
Definition at line 17 of file PTAMVisualizer.cpp.
| bool show_all_kfs_ |
Definition at line 22 of file PTAMVisualizer.cpp.
| bool show_kfs_ |
Definition at line 21 of file PTAMVisualizer.cpp.
| bool show_path_ |
Definition at line 24 of file PTAMVisualizer.cpp.
| bool show_pc_ |
Definition at line 20 of file PTAMVisualizer.cpp.
Definition at line 32 of file PTAMVisualizer.cpp.
Definition at line 33 of file PTAMVisualizer.cpp.