#include "descriptor_surface_based_trainer/Utils.h"
#include <asr_halcon_bridge/halcon_image.h>
#include <boost/make_shared.hpp>
Go to the source code of this file.
Functions | |
bool | check_string_redex (std::string to_check, boost::regex regex) |
Checks a string with the given regex. More... | |
wxBitmap * | createBitmap (const sensor_msgs::Image::ConstPtr &msg, int width, int height) |
Converts a ros-image-message to a bitmap-file used by wxwidgets. More... | |
wxBitmap * | createBitmap (HalconCpp::HImage image, int width, int height) |
Converts a halcon-image to a bitmap-file used by wxwidgets. More... | |
HalconCpp::HImage | drawBoundingBox (HalconCpp::HImage image, std::vector< Eigen::Vector2i > corner_points) |
Draws a bounding box on the given image with the also given corner-points. More... | |
void | get_all_files_with_ext (const boost::filesystem::path &root, const std::string &ext, std::vector< boost::filesystem::path > &ret) |
Gets all files in a directory with a specific extension. More... | |
std::string | trim (std::string input) |
Removes spaces from the beginning and end of the given string. More... | |
wxString | trimDoubleString (wxString input) |
Formats the given string by removing fractional zeros at the end of it. More... | |
bool check_string_redex | ( | std::string | to_check, |
boost::regex | regex | ||
) |
Checks a string with the given regex.
Copyright (C) 2016, Allgeyer Tobias, Hutmacher Robin, Meißner Pascal
This program is free software: you can redistribute it and/or modify it under the terms of the GNU General Public License as published by the Free Software Foundation, either version 3 of the License, or (at your option) any later version.
This program is distributed in the hope that it will be useful, but WITHOUT ANY WARRANTY; without even the implied warranty of MERCHANTABILITY or FITNESS FOR A PARTICULAR PURPOSE. See the GNU General Public License for more details.
You should have received a copy of the GNU General Public License along with this program. If not, see http://www.gnu.org/licenses/.
wxBitmap* createBitmap | ( | const sensor_msgs::Image::ConstPtr & | msg, |
int | width, | ||
int | height | ||
) |
wxBitmap* createBitmap | ( | HalconCpp::HImage | image, |
int | width, | ||
int | height | ||
) |
HalconCpp::HImage drawBoundingBox | ( | HalconCpp::HImage | image, |
std::vector< Eigen::Vector2i > | corner_points | ||
) |
void get_all_files_with_ext | ( | const boost::filesystem::path & | root, |
const std::string & | ext, | ||
std::vector< boost::filesystem::path > & | ret | ||
) |
std::string trim | ( | std::string | input | ) |