#include "srs_object_database_msgs/utility.h"#include <string.h>#include <ros/ros.h>#include <vector>#include <iostream>#include <fstream>#include <sstream>#include <stdint.h>#include <algorithm>#include <iterator>#include <database_interface/postgresql_database.h>#include <database_interface/db_class.h>#include <pcl/ros/conversions.h>#include <pcl/point_cloud.h>#include <pcl/point_types.h>#include <pcl/io/pcd_io.h>#include <pcl/pcl_base.h>#include <pcl/io/io.h>#include "srs_object_database_msgs/point_types.h"#include "srs_object_database_msgs/impl/point_types.cpp"#include "srs_object_database_msgs/surf.h"#include <geometry_msgs/Pose.h>
Go to the source code of this file.
| Functions | |
| std::string | fromCharPt (char *ch) | 
| char * | utConvertToChar (vector< char > inputData) | 
| vector< char > | utConvertToVector (char *inputData) | 
| void | utDataWrite (vector< uint8_t > data, string path) | 
| input | utGetInputParameter (std::string path) | 
| void | utLoadCloudPointFromPLYFile (std::string path, srs_object_database_msgs::pcl::Ptr &pcl) | 
| void | utLoadFeaturePointFromFile (std::string path, srs_object_database_msgs::surf::Ptr &surf) | 
| arm_navigation_msgs::Shape | utLoadMeshFromFile (std::string path) | 
| database_interface::PostgresqlDatabase | utLoadSettings (std::string dbInstance, std::string dbPort, std::string dbUser, std::string dbPwd, std::string dbName) | 
| char * | utRetrieveDataFile (std::string path, int *siz) | 
| void | utWriteToFile (char *data, std::string path, long size) | 
| std::string fromCharPt | ( | char * | ch | ) | 
Definition at line 107 of file utility.cpp.
| char* utConvertToChar | ( | vector< char > | inputData | ) | 
Definition at line 270 of file utility.cpp.
| vector<char> utConvertToVector | ( | char * | inputData | ) | 
Definition at line 258 of file utility.cpp.
| void utDataWrite | ( | vector< uint8_t > | data, | 
| string | path | ||
| ) | 
Definition at line 44 of file utility.cpp.
| input utGetInputParameter | ( | std::string | path | ) | 
Definition at line 116 of file utility.cpp.
| void utLoadCloudPointFromPLYFile | ( | std::string | path, | 
| srs_object_database_msgs::pcl::Ptr & | pcl | ||
| ) | 
Definition at line 517 of file utility.cpp.
| void utLoadFeaturePointFromFile | ( | std::string | path, | 
| srs_object_database_msgs::surf::Ptr & | surf | ||
| ) | 
Definition at line 281 of file utility.cpp.
| arm_navigation_msgs::Shape utLoadMeshFromFile | ( | std::string | path | ) | 
Definition at line 598 of file utility.cpp.
| database_interface::PostgresqlDatabase utLoadSettings | ( | std::string | dbInstance, | 
| std::string | dbPort, | ||
| std::string | dbUser, | ||
| std::string | dbPwd, | ||
| std::string | dbName | ||
| ) | 
Definition at line 249 of file utility.cpp.
| char* utRetrieveDataFile | ( | std::string | path, | 
| int * | siz | ||
| ) | 
Definition at line 78 of file utility.cpp.
| void utWriteToFile | ( | char * | data, | 
| std::string | path, | ||
| long | size | ||
| ) | 
Definition at line 34 of file utility.cpp.