#include <string>
#include <tango_3d_reconstruction/tango_3d_reconstruction_api.h>
#include <tango_support/tango_support.h>
#include <nav_msgs/OccupancyGrid.h>
#include <ros/ros.h>
#include <visualization_msgs/MarkerArray.h>
Go to the source code of this file.
|
bool | tango_3d_reconstruction_helper::ExtractFloorPlanImageAndConvertToOccupancyGrid (const Tango3DR_ReconstructionContext &t3dr_context, double time_offset, const std::string &base_frame_id, double t3dr_resolution, uint8_t threshold, nav_msgs::OccupancyGrid *occupancy_grid) |
|
void | tango_3d_reconstruction_helper::ExtractMeshAndConvertToMarkerArray (const Tango3DR_ReconstructionContext &t3dr_context, const Tango3DR_GridIndexArray &t3dr_updated_indices, double time_offset, const std::string &base_frame_id, visualization_msgs::MarkerArray *mesh_marker_array) |
|
Tango3DR_Status | tango_3d_reconstruction_helper::TangoSetup3DRConfig (const ros::NodeHandle &node_handle, double *t3dr_resolution, Tango3DR_ReconstructionContext *t3dr_context, Tango3DR_CameraCalibration *t3dr_color_camera_intrinsics) |
|
void | tango_3d_reconstruction_helper::UpdateMesh (const Tango3DR_ReconstructionContext &t3dr_context, TangoSupport_PointCloudManager *point_cloud_manager, TangoSupport_ImageBufferManager *image_buffer_manager, Tango3DR_Pose *last_camera_depth_pose, Tango3DR_Pose *last_camera_color_pose, Tango3DR_GridIndexArray *t3dr_updated_indices) |
|