Classes | |
struct | PublishThread |
class | TangoRosNodelet |
Enumerations | |
enum | LocalizationMode { ODOMETRY = 1, ONLINE_SLAM = 2, LOCALIZATION = 3 } |
enum | TangoStatus { UNKNOWN = 0, SERVICE_NOT_CONNECTED, NO_FIRST_VALID_POSE, SERVICE_CONNECTED } |
Variables | |
const std::string | AREA_DESCRIPTION_FRAME_ID_PARAM_NAME = "area_description_frame_id" |
const std::string | AREA_DESCRIPTION_T_START_OF_SERVICE_TOPIC_NAME = "transform/area_description_T_start_of_service" |
const std::string | COLOR_IMAGE_TOPIC_NAME = "camera/color_1/image_raw" |
const std::string | COLOR_MESH_TOPIC_NAME = "reconstruction/mesh" |
const std::string | COLOR_RECTIFIED_IMAGE_TOPIC_NAME = "camera/color_1/image_rect" |
const std::string | CONNECT_SERVICE_NAME = "connect" |
const std::string | CREATE_NEW_MAP_PARAM_NAME = "create_new_map" |
const std::string | DATASET_DEFAULT_DIRECTORY = "/sdcard/tango_ros_streamer/datasets/" |
const std::string | DATASET_DIRECTORY_PARAM_NAME = "dataset_directory" |
const std::string | DATASET_UUID_PARAM_NAME = "dataset_uuid" |
const std::string | ENABLE_3DR_MESH_PARAM_NAME = "enable_3dr_mesh" |
const std::string | ENABLE_3DR_OCCUPANCY_GRID_PARAM_NAME = "enable_3dr_occupancy_grid" |
const std::string | ENABLE_COLOR_CAMERA_PARAM_NAME = "enable_color_camera" |
const std::string | ENABLE_DEPTH_PARAM_NAME = "enable_depth" |
const std::string | FISHEYE_IMAGE_TOPIC_NAME = "camera/fisheye_1/image_raw" |
const std::string | FISHEYE_RECTIFIED_IMAGE_TOPIC_NAME = "camera/fisheye_1/image_rect" |
const std::string | GET_MAP_NAME_SERVICE_NAME = "get_map_name" |
const std::string | GET_MAP_UUIDS_SERVICE_NAME = "get_map_uuids" |
const float | LASER_SCAN_ANGLE_INCREMENT = 3.1415 / 360 |
const float | LASER_SCAN_ANGLE_MAX = 3.1415 |
const float | LASER_SCAN_ANGLE_MIN = 0. |
const std::string | LASER_SCAN_FRAME_ID = "laser" |
const float | LASER_SCAN_SCAN_TIME = 0.3333 |
const float | LASER_SCAN_TIME_INCREMENT = 0.0 |
const std::string | LASER_SCAN_TOPIC_NAME = "laser_scan" |
const std::string | LOAD_OCCUPANCY_GRID_SERVICE_NAME = "load_occupancy_grid" |
const std::string | LOCALIZATION_MAP_UUID_PARAM_NAME = "localization_map_uuid" |
const std::string | LOCALIZATION_MODE_PARAM_NAME = "localization_mode" |
const int | NUMBER_OF_STATIC_TRANSFORMS = 5 |
const std::string | OCCUPANCY_GRID_DEFAULT_DIRECTORY = "/sdcard/tango_ros_streamer/occupancy_grids/" |
const std::string | OCCUPANCY_GRID_DIRECTORY_PARAM_NAME = "occupancy_grid_directory" |
const std::string | OCCUPANCY_GRID_TOPIC_NAME = "reconstruction/occupancy_grid" |
const std::string | POINT_CLOUD_TOPIC_NAME = "point_cloud" |
const std::string | PUBLISH_POSE_ON_TF_PARAM_NAME = "publish_pose_on_tf" |
const std::string | SAVE_MAP_SERVICE_NAME = "save_map" |
const std::string | START_OF_SERVICE_FRAME_ID_PARAM_NAME = "start_of_service_frame_id" |
const std::string | START_OF_SERVICE_T_DEVICE_TOPIC_NAME = "transform/start_of_service_T_device" |
const std::string | STATIC_OCCUPANCY_GRID_TOPIC_NAME = "static_occupancy_grid" |
const std::string | TANGO_STATUS_TOPIC_NAME = "status" |
const std::string | USE_TF_STATIC_PARAM_NAME = "use_tf_static" |
Definition at line 104 of file tango_ros_nodelet.h.
Definition at line 114 of file tango_ros_nodelet.h.
const std::string tango_ros_native::AREA_DESCRIPTION_FRAME_ID_PARAM_NAME = "area_description_frame_id" |
Definition at line 92 of file tango_ros_nodelet.h.
const std::string tango_ros_native::AREA_DESCRIPTION_T_START_OF_SERVICE_TOPIC_NAME = "transform/area_description_T_start_of_service" |
Definition at line 78 of file tango_ros_nodelet.h.
const std::string tango_ros_native::COLOR_IMAGE_TOPIC_NAME = "camera/color_1/image_raw" |
Definition at line 72 of file tango_ros_nodelet.h.
const std::string tango_ros_native::COLOR_MESH_TOPIC_NAME = "reconstruction/mesh" |
Definition at line 74 of file tango_ros_nodelet.h.
const std::string tango_ros_native::COLOR_RECTIFIED_IMAGE_TOPIC_NAME = "camera/color_1/image_rect" |
Definition at line 73 of file tango_ros_nodelet.h.
const std::string tango_ros_native::CONNECT_SERVICE_NAME = "connect" |
Definition at line 99 of file tango_ros_nodelet.h.
const std::string tango_ros_native::CREATE_NEW_MAP_PARAM_NAME = "create_new_map" |
Definition at line 80 of file tango_ros_nodelet.h.
const std::string tango_ros_native::DATASET_DEFAULT_DIRECTORY = "/sdcard/tango_ros_streamer/datasets/" |
Definition at line 63 of file tango_ros_nodelet.h.
const std::string tango_ros_native::DATASET_DIRECTORY_PARAM_NAME = "dataset_directory" |
Definition at line 83 of file tango_ros_nodelet.h.
const std::string tango_ros_native::DATASET_UUID_PARAM_NAME = "dataset_uuid" |
Definition at line 84 of file tango_ros_nodelet.h.
const std::string tango_ros_native::ENABLE_3DR_MESH_PARAM_NAME = "enable_3dr_mesh" |
Definition at line 88 of file tango_ros_nodelet.h.
const std::string tango_ros_native::ENABLE_3DR_OCCUPANCY_GRID_PARAM_NAME = "enable_3dr_occupancy_grid" |
Definition at line 89 of file tango_ros_nodelet.h.
const std::string tango_ros_native::ENABLE_COLOR_CAMERA_PARAM_NAME = "enable_color_camera" |
Definition at line 86 of file tango_ros_nodelet.h.
const std::string tango_ros_native::ENABLE_DEPTH_PARAM_NAME = "enable_depth" |
Definition at line 85 of file tango_ros_nodelet.h.
const std::string tango_ros_native::FISHEYE_IMAGE_TOPIC_NAME = "camera/fisheye_1/image_raw" |
Definition at line 70 of file tango_ros_nodelet.h.
const std::string tango_ros_native::FISHEYE_RECTIFIED_IMAGE_TOPIC_NAME = "camera/fisheye_1/image_rect" |
Definition at line 71 of file tango_ros_nodelet.h.
const std::string tango_ros_native::GET_MAP_NAME_SERVICE_NAME = "get_map_name" |
Definition at line 95 of file tango_ros_nodelet.h.
const std::string tango_ros_native::GET_MAP_UUIDS_SERVICE_NAME = "get_map_uuids" |
Definition at line 96 of file tango_ros_nodelet.h.
const float tango_ros_native::LASER_SCAN_ANGLE_INCREMENT = 3.1415 / 360 |
Definition at line 58 of file tango_ros_nodelet.h.
const float tango_ros_native::LASER_SCAN_ANGLE_MAX = 3.1415 |
Definition at line 57 of file tango_ros_nodelet.h.
const float tango_ros_native::LASER_SCAN_ANGLE_MIN = 0. |
Definition at line 56 of file tango_ros_nodelet.h.
const std::string tango_ros_native::LASER_SCAN_FRAME_ID = "laser" |
Definition at line 61 of file tango_ros_nodelet.h.
const float tango_ros_native::LASER_SCAN_SCAN_TIME = 0.3333 |
Definition at line 60 of file tango_ros_nodelet.h.
const float tango_ros_native::LASER_SCAN_TIME_INCREMENT = 0.0 |
Definition at line 59 of file tango_ros_nodelet.h.
const std::string tango_ros_native::LASER_SCAN_TOPIC_NAME = "laser_scan" |
Definition at line 69 of file tango_ros_nodelet.h.
const std::string tango_ros_native::LOAD_OCCUPANCY_GRID_SERVICE_NAME = "load_occupancy_grid" |
Definition at line 98 of file tango_ros_nodelet.h.
const std::string tango_ros_native::LOCALIZATION_MAP_UUID_PARAM_NAME = "localization_map_uuid" |
Definition at line 82 of file tango_ros_nodelet.h.
const std::string tango_ros_native::LOCALIZATION_MODE_PARAM_NAME = "localization_mode" |
Definition at line 81 of file tango_ros_nodelet.h.
const int tango_ros_native::NUMBER_OF_STATIC_TRANSFORMS = 5 |
Definition at line 65 of file tango_ros_nodelet.h.
const std::string tango_ros_native::OCCUPANCY_GRID_DEFAULT_DIRECTORY = "/sdcard/tango_ros_streamer/occupancy_grids/" |
Definition at line 64 of file tango_ros_nodelet.h.
const std::string tango_ros_native::OCCUPANCY_GRID_DIRECTORY_PARAM_NAME = "occupancy_grid_directory" |
Definition at line 93 of file tango_ros_nodelet.h.
const std::string tango_ros_native::OCCUPANCY_GRID_TOPIC_NAME = "reconstruction/occupancy_grid" |
Definition at line 75 of file tango_ros_nodelet.h.
const std::string tango_ros_native::POINT_CLOUD_TOPIC_NAME = "point_cloud" |
Definition at line 68 of file tango_ros_nodelet.h.
const std::string tango_ros_native::PUBLISH_POSE_ON_TF_PARAM_NAME = "publish_pose_on_tf" |
Definition at line 87 of file tango_ros_nodelet.h.
const std::string tango_ros_native::SAVE_MAP_SERVICE_NAME = "save_map" |
Definition at line 97 of file tango_ros_nodelet.h.
const std::string tango_ros_native::START_OF_SERVICE_FRAME_ID_PARAM_NAME = "start_of_service_frame_id" |
Definition at line 91 of file tango_ros_nodelet.h.
const std::string tango_ros_native::START_OF_SERVICE_T_DEVICE_TOPIC_NAME = "transform/start_of_service_T_device" |
Definition at line 77 of file tango_ros_nodelet.h.
const std::string tango_ros_native::STATIC_OCCUPANCY_GRID_TOPIC_NAME = "static_occupancy_grid" |
Definition at line 76 of file tango_ros_nodelet.h.
const std::string tango_ros_native::TANGO_STATUS_TOPIC_NAME = "status" |
Definition at line 67 of file tango_ros_nodelet.h.
const std::string tango_ros_native::USE_TF_STATIC_PARAM_NAME = "use_tf_static" |
Definition at line 90 of file tango_ros_nodelet.h.