SourceXtractorPlusPlus
0.14
Please provide a description of the project.
|
Namespaces | |
ExternalFlagCombineTypes | |
Enumerations | |
enum | FrameImageLayer { LayerOriginalImage = 0, LayerInterpolatedImage, LayerSubtractedImage, LayerFilteredImage, LayerThresholdedImage, LayerSignalToNoiseMap, LayerOriginalVarianceMap, LayerUnfilteredVarianceMap, LayerVarianceMap, LayerDetectionThresholdMap } |
enum | Flags : int64_t { Flags::NONE = 0, Flags::BIASED = 1ll << 0, Flags::BLENDED = 1ll << 1, Flags::SATURATED = 1ll << 2, Flags::BOUNDARY = 1ll << 3, Flags::NEIGHBORS = 1ll << 4, Flags::OUTSIDE = 1ll << 5, Flags::PARTIAL_FIT = 1ll << 6, Flags::INSUFFICIENT_DATA = 1ll << 7, Flags::ERROR = 1ll << 10 } |
Flagging of bad sources. More... | |
enum | interpenum { INTERP_NEARESTNEIGHBOUR, INTERP_BILINEAR, INTERP_LANCZOS2, INTERP_LANCZOS3, INTERP_LANCZOS4 } |
enum | LutzStatus { LutzStatus::COMPLETE = 0, LutzStatus::INCOMPLETE, LutzStatus::NONOBJECT, LutzStatus::OBJECT } |
enum | LutzMarker { LutzMarker::ZERO = 0, LutzMarker::S, LutzMarker::S0, LutzMarker::F, LutzMarker::F0 } |
Functions | |
Flags | computeFlags (const std::shared_ptr< Aperture > &aperture, SeFloat centroid_x, SeFloat centroid_y, const std::vector< PixelCoordinate > &pix_list, const std::shared_ptr< Image< SeFloat >> &detection_img, const std::shared_ptr< Image< SeFloat >> &detection_variance, const std::shared_ptr< Image< SeFloat >> &threshold_image, SeFloat variance_threshold) |
FluxMeasurement | measureFlux (const std::shared_ptr< Aperture > &aperture, SeFloat centroid_x, SeFloat centroid_y, const std::shared_ptr< Image< SeFloat >> &img, const std::shared_ptr< Image< SeFloat >> &variance_map, SeFloat variance_threshold, bool use_symmetry) |
template<typename T > | |
void | fillAperture (const std::shared_ptr< Aperture > &aperture, SeFloat centroid_x, SeFloat centroid_y, const std::shared_ptr< WriteableImage< T >> &img, T value) |
int | fftRoundDimension (int size) |
int | ReplicateCoordinates (int N, int v) |
int | ReflectCoordinates (int N, int v) |
int | Reflect101Coordinates (int N, int v) |
int | WrapCoordinates (int N, int v) |
std::ostream & | operator<< (std::ostream &out, const TileKey &tk) |
constexpr Flags | operator| (const Flags &a, const Flags &b) |
constexpr Flags | operator& (const Flags &a, const Flags &b) |
constexpr Flags | operator* (const Flags &a, const bool b) |
Flags & | operator|= (Flags &a, const Flags &b) |
constexpr int64_t | flags2long (const Flags &a) |
std::vector< int64_t > | flags2long (const std::vector< Flags > &v) |
static std::tuple< SeFloat, SeFloat > | getMirrorPixel (SeFloat centroid_x, SeFloat centroid_y, int pixel_x, int pixel_y, const std::shared_ptr< Image< SeFloat >> &img, const std::shared_ptr< Image< SeFloat >> &variance_map, SeFloat variance_threshold) |
std::pair< double, double > | transform (int x, int y, const std::array< double, 4 > &t) |
static void | wcsRaiseOnParseError (int ret_code) |
static void | wcsLogErr (wcserr *err) |
static void | wcsRaiseOnTransformError (wcsprm *wcs, int ret_code) |
static std::set< std::string > | wcsExtractKeywords (const char *header, int number_of_records) |
static void | wcsCheckHeaders (const wcsprm *wcs, const char *headers_str, int number_of_records) |
static void | wcsReportWarnings (const char *err_buffer) |
static int | wrapped_lincpy (int alloc, const struct linprm *linsrc, struct linprm *lindst) |
static MetadataEntry::value_t | valueAutoCast (const std::string &value) |
float | interpolate_pix (float *pix, float x, float y, int xsize, int ysize, interpenum interptype) |
bool | operator< (std::reference_wrapper< const SourceInterface > a, std::reference_wrapper< const SourceInterface > b) |
static float | computeScaling (const std::shared_ptr< VectorImage< DetectionImage::PixelType >> &variance, const std::shared_ptr< VectorImage< WeightImage::PixelType >> &weight) |
static float | getMedian (const VectorImage< DetectionImage::PixelType > &img) |
template<typename R , typename... T> | |
R | py_call_wrapper (const py::object &func, T...args) |
static bool | getNormalization (std::istream &line_stream) |
template<typename T > | |
static void | extractValues (std::istream &line_stream, std::vector< T > &data) |
static WeightImage::PixelType | computeWeightThreshold (WeightImageConfig::WeightType weight_type, double threshold) |
bool | operator< (SourceGroupInterface::iterator a, SourceGroupInterface::iterator b) |
static void | makeLanczos2Kernel (float pos, float *kernel, const float threshold) |
static void | makeLanczos3Kernel (float pos, float *kernel, const float threshold) |
static void | makeLanczos4Kernel (float pos, float *kernel, const float threshold) |
void | make_kernel (float pos, float *kernel, interpenum interptype) |
double | getClamped (const ImageInterfaceTypePtr &image, int x, int y) |
void | shiftResize (const ImageInterfaceTypePtr &source, ImageInterfaceTypePtr &window, double scale_factor, double x_shift, double y_shift) |
void | shiftResizeLancszos (const ImageInterfaceTypePtr &source, ImageInterfaceTypePtr &window, double scale_factor, double x_shift, double y_shift) |
void | shiftResizeLancszosFast (const ImageInterfaceTypePtr &source, ImageInterfaceTypePtr &window, double scale_factor, double x_shift, double y_shift) |
template<typename T > | |
std::string | generateHeader (const std::string &name, T value, const std::string &comment) |
template<> | |
std::string | generateHeader< std::string > (const std::string &name, std::string value, const std::string &comment) |
static void | generateHistory (std::vector< std::string > &headers) |
static double | computeBn (double n) |
static SeFloat | getPixelValue (int x, int y, SeFloat centroid_x, SeFloat centroid_y, const std::shared_ptr< Image< SeFloat >> &image, const std::shared_ptr< Image< SeFloat >> &variance_map, SeFloat variance_threshold, bool use_symmetry) |
template<typename T > | |
static void | fillCutout (const Image< T > &image, int center_x, int center_y, int width, int height, std::vector< T > &out) |
template<typename O > | |
static std::unique_ptr < OnnxProperty::NdWrapperBase > | computePropertiesSpecialized (const OnnxModel &model, const DetectionFrameImages &detection_frame_images, const PixelCentroid ¢roid) |
static std::string | generatePropertyName (const OnnxModel &model_info, OrtAllocator *allocator) |
static std::string | formatShape (const std::vector< int64_t > &shape) |
template<typename T > | |
static void | registerColumnConverter (OutputRegistry ®istry, const OnnxModel &model) |
static std::shared_ptr < VariablePsf > | readPsfEx (std::unique_ptr< CCfits::FITS > &pFits, int hdu_number=1) |
template<typename T > | |
static std::shared_ptr < VariablePsf > | readImage (T &image_hdu) |
static double | getCoordX (SourceXtractor::SourceGroupInterface &group, unsigned instance) |
static double | getCoordY (SourceXtractor::SourceGroupInterface &group, unsigned instance) |
BOOST_PYTHON_MODULE (_SourceXtractorPy) | |
static std::tuple< float, float > | applyKernel (const VectorImage< SeFloat > &kernel, ImageChunk< SeFloat > &image_chunk, ImageChunk< SeFloat > &variance_chunk, int start_x, int start_y, int clip_w, int clip_h, SeFloat threshold) |
static void | handleTerminatingSignal (int s) |
static void | handleStopSignal (int s) |
static void | handleContinuationSignal (int s) |
static void | handleResizeSignal (int) |
static int | interceptFileDescriptor (int old_fd, int *backup_fd) |
static void | override_rl_display (void) |
static unsigned int | extractSourceId (const SourceInterface &i) |
bool | isClose (double a, double b, double atol=1e-8, double rtol=1e-5) |
template<typename T > | |
T | nextPowerOfTwo (T v) |
Elements::Exception | pyToElementsException (Elements::Logging &logger) |
template<typename T , typename U > | |
boost::test_tools::predicate_result | compareImages (const T &ref, const U &val, double atol=1e-8, double rtol=1e-5) |
template<typename T , typename U > | |
boost::test_tools::predicate_result | compareCollections (const T &ref, const U &val, double atol=1e-8, double rtol=1e-5) |
boost::test_tools::predicate_result | checkIsClose (double ref, const double val, double atol=1e-8, double rtol=1e-5) |
template<typename To , typename From > | |
To | VariantCast (const From &from) |
Copyright © 2019 Université de Genève, LMU Munich - Faculty of Physics, IAP-CNRS/Sorbonne Université
This library is free software; you can redistribute it and/or modify it under the terms of the GNU Lesser General Public License as published by the Free Software Foundation; either version 3.0 of the License, or (at your option) any later version.
This library 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 Lesser General Public License for more details.
You should have received a copy of the GNU Lesser General Public License along with this library; if not, write to the Free Software Foundation, Inc., 51 Franklin Street, Fifth Floor, Boston, MA 02110-1301 USA
Copyright © 2020 Université de Genève, LMU Munich - Faculty of Physics, IAP-CNRS/Sorbonne Université
This library is free software; you can redistribute it and/or modify it under the terms of the GNU Lesser General Public License as published by the Free Software Foundation; either version 3.0 of the License, or (at your option) any later version.
This library 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 Lesser General Public License for more details.
You should have received a copy of the GNU Lesser General Public License along with this library; if not, write to the Free Software Foundation, Inc., 51 Franklin Street, Fifth Floor, Boston, MA 02110-1301 USA
typedef DFTConvolution<SeFloat, PaddedImage<SeFloat, Reflect101Coordinates> > SourceXtractor::DefaultConvolutionStrategy |
For convenience, default convolution strategy.
Definition at line 34 of file Convolution.h.
using SourceXtractor::DetectionImage = typedef Image<SeFloat> |
using SourceXtractor::DetectionImageFrame = typedef Frame<DetectionImage::PixelType> |
Definition at line 39 of file ImageProcessing.h.
using SourceXtractor::DetectionImageProcessingList = typedef ImageProcessingList<DetectionImage::PixelType> |
Definition at line 64 of file ImageProcessingList.h.
typedef Observable<bool> SourceXtractor::DoneObservable |
Definition at line 43 of file ProgressMediator.h.
typedef Observer<bool> SourceXtractor::DoneObserver |
Definition at line 35 of file ProgressReporter.h.
Definition at line 68 of file ExternalFlagTask.h.
Definition at line 74 of file ExternalFlagTask.h.
Definition at line 71 of file ExternalFlagTask.h.
using SourceXtractor::ExternalFlagTaskMost = typedef ExternalFlagTask<ExternalFlagCombineTypes::Most> |
Definition at line 77 of file ExternalFlagTask.h.
Definition at line 65 of file ExternalFlagTask.h.
using SourceXtractor::FlagImage = typedef Image<std::int64_t> |
using SourceXtractor::MeasurementImage = typedef Image<SeFloat> |
using SourceXtractor::MeasurementImageFrame = typedef Frame<MeasurementImage::PixelType> |
using SourceXtractor::MultiplyImage = typedef ProcessedImage<T, MultiplyOperation<T>> |
Definition at line 116 of file ProcessedImage.h.
using SourceXtractor::NdArray = typedef Euclid::NdArray::NdArray<T> |
Definition at line 37 of file VignetPlugin.h.
typedef float SourceXtractor::PIXTYPE |
Definition at line 30 of file BackgroundDefine.h.
Definition at line 42 of file ProgressMediator.h.
Definition at line 34 of file ProgressReporter.h.
using SourceXtractor::SeFloat = typedef SeFloat32 |
using SourceXtractor::SeFloat32 = typedef float |
using SourceXtractor::SeFloat64 = typedef double |
using SourceXtractor::SnrImage = typedef ProcessedImage<T, SnrOperation<T>> |
Definition at line 125 of file ProcessedImage.h.
using SourceXtractor::SubtractImage = typedef ProcessedImage<T, SubtractOperation<T>> |
Definition at line 107 of file ProcessedImage.h.
using SourceXtractor::Traits = typedef ModelFitting::ImageTraits<ImageInterfaceTypePtr> |
Definition at line 14 of file ImageInterfaceTraits.cpp.
typedef std::function<double(SourceXtractor::SourceGroupInterface &group, unsigned instance)> SourceXtractor::ValueGetter |
using SourceXtractor::WeightImage = typedef Image<SeFloat> |
|
strong |
Flagging of bad sources.
Definition at line 34 of file SourceFlags.h.
Enumerator | |
---|---|
INTERP_NEARESTNEIGHBOUR | |
INTERP_BILINEAR | |
INTERP_LANCZOS2 | |
INTERP_LANCZOS3 | |
INTERP_LANCZOS4 |
Definition at line 103 of file ImageInterfaceTraits.h.
|
strong |
|
strong |
|
static |
Definition at line 44 of file BgConvolutionImageSource.cpp.
References SourceXtractor::VectorImage< T >::getHeight(), SourceXtractor::ImageChunk< T >::getValue(), SourceXtractor::VectorImage< T >::getValue(), SourceXtractor::VectorImage< T >::getWidth(), and std::make_pair().
Referenced by SourceXtractor::BgConvolutionImageSource::generateTile().
SourceXtractor::BOOST_PYTHON_MODULE | ( | _SourceXtractorPy | ) |
Definition at line 40 of file PythonModule.cpp.
References SourceXtractor::PyAperture::apertures, BIASED, BOUNDARY, SourceXtractor::PyOutputWrapper::close(), SourceXtractor::PyOutputWrapper::closed, SourceXtractor::PyMeasurementImage::constant_background_value, ERROR, SourceXtractor::PyMeasurementImage::file, SourceXtractor::PyOutputWrapper::fileno(), SourceXtractor::PyOutputWrapper::flush(), SourceXtractor::PyMeasurementImage::flux_scale, SourceXtractor::PyMeasurementImage::gain, SourceXtractor::ObjectInfo::getAngle(), SourceXtractor::ObjectInfo::getAspectRatio(), SourceXtractor::ObjectInfo::getCentroidX(), SourceXtractor::ObjectInfo::getCentroidY(), SourceXtractor::PyFitsFile::getFilename(), SourceXtractor::PyFitsFile::getHeaders(), SourceXtractor::PyFitsFile::getImageHdus(), SourceXtractor::ObjectInfo::getIsoFlux(), SourceXtractor::ObjectInfo::getRadius(), SourceXtractor::PyMeasurementImage::has_weight_threshold, SourceXtractor::PyId::id, SourceXtractor::PyMeasurementImage::image_hdu, SourceXtractor::CoordinateSystem::imageToWorld(), INSUFFICIENT_DATA, SourceXtractor::PyMeasurementImage::is_background_constant, SourceXtractor::PyOutputWrapper::isatty(), SourceXtractor::WorldCoordinate::m_alpha, SourceXtractor::WorldCoordinate::m_delta, SourceXtractor::ImageCoordinate::m_x, SourceXtractor::ImageCoordinate::m_y, NEIGHBORS, NONE, OUTSIDE, PARTIAL_FIT, SourceXtractor::PyMeasurementImage::psf_file, SourceXtractor::PyMeasurementImage::psf_hdu, SourceXtractor::PyOutputWrapper::read(), SourceXtractor::PyOutputWrapper::readable(), SourceXtractor::PyOutputWrapper::readline(), SourceXtractor::PyOutputWrapper::readlines(), SATURATED, SourceXtractor::PyMeasurementImage::saturation, SourceXtractor::PyOutputWrapper::seek(), SourceXtractor::PyOutputWrapper::seekable(), SourceXtractor::PyOutputWrapper::tell(), SourceXtractor::PyAperture::toString(), SourceXtractor::PyOutputWrapper::truncate(), SourceXtractor::PyMeasurementImage::weight_absolute, SourceXtractor::PyMeasurementImage::weight_file, SourceXtractor::PyMeasurementImage::weight_hdu, SourceXtractor::PyMeasurementImage::weight_scaling, SourceXtractor::PyMeasurementImage::weight_threshold, SourceXtractor::PyMeasurementImage::weight_type, SourceXtractor::CoordinateSystem::worldToImage(), SourceXtractor::PyOutputWrapper::writable(), SourceXtractor::PyOutputWrapper::write(), and SourceXtractor::PyOutputWrapper::writelines().
boost::test_tools::predicate_result SourceXtractor::checkIsClose | ( | double | ref, |
const double | val, | ||
double | atol = 1e-8 , |
||
double | rtol = 1e-5 |
||
) |
Definition at line 80 of file TestUtils.h.
References std::atol(), and isClose().
boost::test_tools::predicate_result SourceXtractor::compareCollections | ( | const T & | ref, |
const U & | val, | ||
double | atol = 1e-8 , |
||
double | rtol = 1e-5 |
||
) |
Definition at line 52 of file TestUtils.h.
References std::atol(), std::begin(), std::end(), and isClose().
boost::test_tools::predicate_result SourceXtractor::compareImages | ( | const T & | ref, |
const U & | val, | ||
double | atol = 1e-8 , |
||
double | rtol = 1e-5 |
||
) |
Definition at line 32 of file TestUtils.h.
References std::atol(), isClose(), x, and y.
|
static |
Definition at line 190 of file FlexibleModelFittingModel.cpp.
Referenced by SourceXtractor::FlexibleModelFittingSersicModel::addForSource().
Flags SourceXtractor::computeFlags | ( | const std::shared_ptr< Aperture > & | aperture, |
SeFloat | centroid_x, | ||
SeFloat | centroid_y, | ||
const std::vector< PixelCoordinate > & | pix_list, | ||
const std::shared_ptr< Image< SeFloat >> & | detection_img, | ||
const std::shared_ptr< Image< SeFloat >> & | detection_variance, | ||
const std::shared_ptr< Image< SeFloat >> & | threshold_image, | ||
SeFloat | variance_threshold | ||
) |
Definition at line 27 of file Flagging.cpp.
References BADAREA_THRESHOLD_APER, BIASED, BOUNDARY, CROWD_THRESHOLD_APER, SourceXtractor::NeighbourInfo::isNeighbourObjectPixel(), NEIGHBORS, and NONE.
Referenced by SourceXtractor::ApertureFlagTask::computeProperties(), and SourceXtractor::AutoPhotometryFlagTask::computeProperties().
|
static |
Templated implementation of computeProperties
An ONNX model can have different input and output element types (float, integer) with different precision. We only support float for input, but in order to support also integer outputs (i.e for classification) we template the computeProperties method on the output value type
Definition at line 59 of file OnnxSourceTask.cpp.
References std::accumulate(), std::vector< T >::begin(), std::string::c_str(), std::vector< T >::data(), std::vector< T >::end(), fillCutout(), SourceXtractor::PixelCentroid::getCentroidX(), SourceXtractor::PixelCentroid::getCentroidY(), SourceXtractor::DetectionFrameImages::getLockedImage(), LayerSubtractedImage, SourceXtractor::OnnxModel::m_input_name, SourceXtractor::OnnxModel::m_input_shape, SourceXtractor::OnnxModel::m_output_name, SourceXtractor::OnnxModel::m_output_shape, SourceXtractor::OnnxModel::m_session, and std::vector< T >::size().
|
static |
Definition at line 44 of file SEBackgroundLevelAnalyzer.cpp.
References std::vector< T >::begin(), std::vector< T >::emplace_back(), std::vector< T >::end(), std::vector< T >::reserve(), std::vector< T >::size(), std::sort(), x, and y.
Referenced by SourceXtractor::SEBackgroundLevelAnalyzer::analyzeBackground().
|
static |
Definition at line 78 of file WeightImageConfig.cpp.
References std::numeric_limits::max(), SourceXtractor::WeightImageConfig::WEIGHT_TYPE_FROM_BACKGROUND, SourceXtractor::WeightImageConfig::WEIGHT_TYPE_RMS, SourceXtractor::WeightImageConfig::WEIGHT_TYPE_VARIANCE, and SourceXtractor::WeightImageConfig::WEIGHT_TYPE_WEIGHT.
Referenced by SourceXtractor::WeightImageConfig::initialize().
|
static |
Definition at line 23 of file Sorter.cpp.
References SourceXtractor::SourceInterface::getProperty().
Referenced by SourceXtractor::Sorter::handleMessage().
|
static |
Definition at line 167 of file SegmentationConfig.cpp.
References std::istream::good(), and std::vector< T >::push_back().
Referenced by SourceXtractor::SegmentationConfig::loadASCIIFilter().
int SourceXtractor::fftRoundDimension | ( | int | size | ) |
FFTW is best at handling sizes of the form 2^a 3^b 5^c 7^d 11^e 13^f where e+f is either 0 or 1. It can compute any size, but to make things faster, this function will return a new size greater of equal to 'size' that falls into the previously mentioned form. It really improves the performance. Of course, there has to be an equilibrium, if the rounded-up size is too far, then the overhead of computing more data won't pay off. For size >= 1024, if will be rounded up to the next multiple of 512.
size | The size to round up |
Definition at line 49 of file FFT.cpp.
Referenced by SourceXtractor::DFTConvolution< DetectionImage::PixelType, PaddedType >::prepare().
void SourceXtractor::fillAperture | ( | const std::shared_ptr< Aperture > & | aperture, |
SeFloat | centroid_x, | ||
SeFloat | centroid_y, | ||
const std::shared_ptr< WriteableImage< T >> & | img, | ||
T | value | ||
) |
Fill the pixels that fall within the aperture with the given value. Useful for debugging.
T |
aperture | Aperture to use |
centroid_x | Center of the aperture on the X axis |
centroid_y | Center of the aperture on the Y axis |
img | Image to modify |
value | Value to use for the fill |
Definition at line 81 of file FluxMeasurement.h.
|
static |
Definition at line 32 of file OnnxSourceTask.cpp.
References SourceXtractor::Image< T >::getHeight(), SourceXtractor::Image< T >::getValue(), SourceXtractor::Image< T >::getWidth(), ModelFitting::height, and ModelFitting::width.
Referenced by computePropertiesSpecialized().
|
inline |
Definition at line 67 of file SourceFlags.h.
Referenced by SourceXtractor::AperturePhotometryArray::AperturePhotometryArray(), flags2long(), SourceXtractor::FlexibleModelFittingPlugin::registerPlugin(), SourceXtractor::AutoPhotometryPlugin::registerPlugin(), and SourceXtractor::SourceFlagsPlugin::registerPlugin().
|
inline |
Definition at line 71 of file SourceFlags.h.
References std::vector< T >::emplace_back(), and flags2long().
|
static |
Pretty-print a vector with shape information
Definition at line 56 of file OnnxTaskFactory.cpp.
References std::vector< T >::back(), std::vector< T >::begin(), std::vector< T >::end(), and std::ostringstream::str().
Referenced by SourceXtractor::OnnxTaskFactory::configure().
std::string SourceXtractor::generateHeader | ( | const std::string & | name, |
T | value, | ||
const std::string & | comment | ||
) |
Definition at line 64 of file LdacWriter.cpp.
References std::left(), std::right(), std::scientific(), std::setw(), std::string::size(), and std::stringstream::str().
Referenced by SourceXtractor::LdacWriter::writeImHead().
std::string SourceXtractor::generateHeader< std::string > | ( | const std::string & | name, |
std::string | value, | ||
const std::string & | comment | ||
) |
Definition at line 82 of file LdacWriter.cpp.
References std::left(), std::setw(), and std::stringstream::str().
|
static |
Definition at line 101 of file LdacWriter.cpp.
References e, std::vector< T >::emplace_back(), std::gmtime(), std::left(), std::setw(), std::stringstream::str(), std::strftime(), and std::time().
Referenced by SourceXtractor::LdacWriter::writeImHead().
|
static |
Generate a property name based on domain, graph name and output name
Definition at line 35 of file OnnxTaskFactory.cpp.
References std::string::empty(), SourceXtractor::OnnxModel::m_output_name, SourceXtractor::OnnxModel::m_session, and std::stringstream::str().
Referenced by SourceXtractor::OnnxTaskFactory::configure().
|
inline |
Definition at line 206 of file ImageInterfaceTraits.cpp.
References ModelFitting::ImageTraits< ImageInterfaceTypePtr >::at(), ModelFitting::ImageTraits< ImageInterfaceTypePtr >::height(), std::max(), std::min(), and ModelFitting::ImageTraits< ImageInterfaceTypePtr >::width().
Referenced by ModelFitting::ImageTraits< WriteableInterfaceTypePtr >::shiftResize(), and shiftResize().
|
static |
Definition at line 33 of file PsfTask.cpp.
References SourceXtractor::SourceInterface::getProperty(), SourceXtractor::MeasurementFrameGroupRectangle::getTopLeft(), and SourceXtractor::PixelCoordinate::m_x.
|
static |
Definition at line 39 of file PsfTask.cpp.
References SourceXtractor::SourceInterface::getProperty(), SourceXtractor::MeasurementFrameGroupRectangle::getTopLeft(), and SourceXtractor::PixelCoordinate::m_y.
|
static |
Definition at line 69 of file SEBackgroundLevelAnalyzer.cpp.
References SourceXtractor::VectorImage< T >::getData(), and std::sort().
Referenced by SourceXtractor::SEBackgroundLevelAnalyzer::analyzeBackground().
|
static |
Definition at line 32 of file FluxMeasurement.cpp.
References std::make_pair().
Referenced by measureFlux().
|
static |
Definition at line 150 of file SegmentationConfig.cpp.
Referenced by SourceXtractor::SegmentationConfig::loadASCIIFilter().
|
static |
Definition at line 37 of file GrowthCurveTask.cpp.
Referenced by SourceXtractor::GrowthCurveTask::computeProperties().
|
static |
Intercept SIGCONT (after fg, for instance)
Definition at line 279 of file ProgressNCurses.cpp.
Referenced by SourceXtractor::Screen::Screen().
|
static |
Intercept SIGWICH (resize)
Definition at line 288 of file ProgressNCurses.cpp.
References signal_fds.
Referenced by SourceXtractor::Screen::Screen().
|
static |
Intercept SIGTSTP (Ctrl+Z)
Definition at line 265 of file ProgressNCurses.cpp.
References prev_signal.
Referenced by SourceXtractor::Screen::Screen().
|
static |
Intercept several terminating signals so the terminal style can be restored
We can only call signal safe functions here: see man 7 signal-safety
. We use a pipe to communicate the signals, as write is safe. It would be nice to use C++ types for the thread synchronization, but they may not be signal safe. From C++14: The common subset of the C and C++ languages consists of all declarations, definitions, and expressions that may appear in a well formed C++ program and also in a conforming C program. A POF (“plain old function”) is a function that uses only features from this common subset, and that does not directly or indirectly use any function that is not a POF. [...] The behavior of any function other than a POF used as a signal handler in a C++ program is implementation-defined. Therefore we resort to semaphores (sem_*), which are signal safe
Definition at line 234 of file ProgressNCurses.cpp.
References SourceXtractor::ncurses_done::m_semaphore, prev_signal, and signal_fds.
Referenced by SourceXtractor::Screen::Screen().
|
static |
Intercepts writes to a file descriptor old_fd into a pipe, and returns the reading end
old_fd | File descriptor to intercept |
backup_fd | Duplicate the file descriptor and put it here, so we can restore later |
Definition at line 70 of file ProgressNCurses.cpp.
References std::generic_category().
Referenced by SourceXtractor::ProgressNCurses::Dashboard::Dashboard().
float SourceXtractor::interpolate_pix | ( | float * | pix, |
float | x, | ||
float | y, | ||
int | xsize, | ||
int | ysize, | ||
interpenum | interptype | ||
) |
Definition at line 147 of file ImageInterfaceTraits.cpp.
References dx, dy, INTERP_MAXKERNELWIDTH, INTERP_NEARESTNEIGHBOUR, and make_kernel().
Referenced by ModelFitting::ImageTraits< WriteableInterfaceTypePtr >::shiftResizeLancszos(), and shiftResizeLancszos().
bool SourceXtractor::isClose | ( | double | a, |
double | b, | ||
double | atol = 1e-8 , |
||
double | rtol = 1e-5 |
||
) |
Definition at line 28 of file IsClose.h.
References std::atol().
Referenced by checkIsClose(), compareCollections(), compareImages(), BenchBackgroundConvolution::verifyResults(), and BenchConvolution::verifyResults().
|
inline |
Definition at line 122 of file ImageInterfaceTraits.cpp.
References e, INTERP_BILINEAR, INTERP_LANCZOS2, INTERP_LANCZOS3, INTERP_LANCZOS4, INTERP_NEARESTNEIGHBOUR, makeLanczos2Kernel(), makeLanczos3Kernel(), and makeLanczos4Kernel().
Referenced by interpolate_pix(), and shiftResizeLancszosFast().
|
static |
Definition at line 17 of file ImageInterfaceTraits.cpp.
Referenced by make_kernel().
|
static |
Definition at line 44 of file ImageInterfaceTraits.cpp.
Referenced by make_kernel().
|
static |
Definition at line 79 of file ImageInterfaceTraits.cpp.
Referenced by make_kernel().
FluxMeasurement SourceXtractor::measureFlux | ( | const std::shared_ptr< Aperture > & | aperture, |
SeFloat | centroid_x, | ||
SeFloat | centroid_y, | ||
const std::shared_ptr< Image< SeFloat >> & | img, | ||
const std::shared_ptr< Image< SeFloat >> & | variance_map, | ||
SeFloat | variance_threshold, | ||
bool | use_symmetry | ||
) |
Measure the flux on an image
aperture | Aperture to use |
centroid_x | Center of the aperture on the X axis |
centroid_y | Center of the aperture on the Y axis |
img | The image where to measure |
variance_map | Variance map |
variance_threshold | If the pixel value in the variance map is greater than this value, the pixel will be ignored |
use_symmetry | If the pixel is ignored, try using the symmetric point value instead |
Definition at line 49 of file FluxMeasurement.cpp.
References BADAREA_THRESHOLD_APER, BIASED, BOUNDARY, getMirrorPixel(), SourceXtractor::FluxMeasurement::m_bad_area, SourceXtractor::FluxMeasurement::m_flags, SourceXtractor::FluxMeasurement::m_flux, SourceXtractor::FluxMeasurement::m_total_area, SourceXtractor::FluxMeasurement::m_variance, OUTSIDE, and std::tie().
Referenced by SourceXtractor::AperturePhotometryTask::computeProperties(), and SourceXtractor::AutoPhotometryTask::computeProperties().
T SourceXtractor::nextPowerOfTwo | ( | T | v | ) |
Definition at line 26 of file Misc.h.
Referenced by SourceXtractor::HilbertCurve::HilbertCurve().
|
inline |
Definition at line 53 of file SourceFlags.h.
constexpr Flags SourceXtractor::operator* | ( | const Flags & | a, |
const bool | b | ||
) |
Definition at line 58 of file SourceFlags.h.
References NONE.
|
inline |
Definition at line 37 of file FlexibleModelFittingParameterManager.h.
References std::reference_wrapper::get().
|
inline |
Definition at line 41 of file Cleaning.cpp.
|
inline |
Definition at line 57 of file TileManager.h.
References SourceXtractor::TileKey::getRepr().
|
inline |
Definition at line 48 of file SourceFlags.h.
|
inline |
Definition at line 62 of file SourceFlags.h.
|
static |
But why? You may ask. Because it looks like before Python 3.7, when loading the SourceXtractor++ Python configuration, something would trigger the loading of readline, which in turns tries to get the terminal size, overwriting LINES and COLS and leaving them with the default 80x24 (Maybe because we intercept stderr/stdout?) This leaves our ncurses UI in a bad shape, not being able to properly go back to the former state at exiting. Looking at the readline code, it appears like we can avoid a call into tgetent if we override rl_redisplay_function
Definition at line 103 of file ProgressNCurses.cpp.
Referenced by SourceXtractor::Screen::Screen().
R SourceXtractor::py_call_wrapper | ( | const py::object & | func, |
T... | args | ||
) |
Wrap py::extract and the call so Python errors can be properly translated and logged
R | Return type |
T | Variadic template for any arbitrary number of arguments |
func | Python function to be called |
args | Arguments for the Python function |
Elements::Exception | if either the call or the extract throw a Python exception |
Definition at line 60 of file ModelFittingConfig.cpp.
References e, Euclid::Configuration::logger, and pyToElementsException().
Elements::Exception SourceXtractor::pyToElementsException | ( | Elements::Logging & | logger | ) |
Dumps into ERR the traceback and returns an Elements exception to be re-thrown
logger | Dumps the traceback to this logger |
Definition at line 30 of file Python.cpp.
References std::string::empty(), Elements::Logging::error(), and conf::filename.
Referenced by SourceXtractor::PythonInterpreter::getApertureOutputColumns(), SourceXtractor::PythonInterpreter::getApertures(), SourceXtractor::PythonInterpreter::getFrameModelsMap(), SourceXtractor::PythonInterpreter::getMeasurementGroups(), SourceXtractor::PythonInterpreter::getMeasurementImages(), SourceXtractor::PythonInterpreter::getModelFittingOutputColumns(), SourceXtractor::ModelFittingConfig::initialize(), SourceXtractor::ModelFittingConfig::initializeInner(), py_call_wrapper(), SourceXtractor::PythonInterpreter::runCode(), and SourceXtractor::PythonInterpreter::runFile().
|
static |
Definition at line 126 of file PsfPluginConfig.cpp.
References std::begin(), std::copy(), SourceXtractor::VectorImage< T >::create(), std::end(), and logger.
Referenced by SourceXtractor::PsfPluginConfig::readPsf().
|
static |
Definition at line 43 of file PsfPluginConfig.cpp.
References std::begin(), component_value_getters, SourceXtractor::VectorImage< T >::create(), e, ModelFitting::height, logger, Elements::Exception::message, std::to_string(), and ModelFitting::width.
Referenced by SourceXtractor::PsfPluginConfig::readPsf().
|
inline |
Definition at line 53 of file PaddedImage.h.
References std::max().
|
inline |
Definition at line 36 of file PaddedImage.h.
|
static |
Definition at line 128 of file OnnxTaskFactory.cpp.
References SourceXtractor::OnnxModel::m_model_path, SourceXtractor::OnnxModel::m_prop_name, and SourceXtractor::OutputRegistry::registerColumnConverter().
|
inline |
Definition at line 30 of file PaddedImage.h.
void SourceXtractor::shiftResize | ( | const ImageInterfaceTypePtr & | source, |
ImageInterfaceTypePtr & | window, | ||
double | scale_factor, | ||
double | x_shift, | ||
double | y_shift | ||
) |
Definition at line 211 of file ImageInterfaceTraits.cpp.
References ModelFitting::ImageTraits< ImageInterfaceTypePtr >::at(), std::floor(), getClamped(), ModelFitting::ImageTraits< ImageInterfaceTypePtr >::height(), ModelFitting::ImageTraits< ImageInterfaceTypePtr >::width(), x, and y.
void SourceXtractor::shiftResizeLancszos | ( | const ImageInterfaceTypePtr & | source, |
ImageInterfaceTypePtr & | window, | ||
double | scale_factor, | ||
double | x_shift, | ||
double | y_shift | ||
) |
Definition at line 237 of file ImageInterfaceTraits.cpp.
References ModelFitting::ImageTraits< ImageInterfaceTypePtr >::at(), ModelFitting::ImageTraits< ImageInterfaceTypePtr >::height(), INTERP_LANCZOS4, interpolate_pix(), ModelFitting::ImageTraits< ImageInterfaceTypePtr >::width(), x, and y.
Referenced by ModelFitting::ImageTraits< WriteableInterfaceTypePtr >::addImageToImage().
void SourceXtractor::shiftResizeLancszosFast | ( | const ImageInterfaceTypePtr & | source, |
ImageInterfaceTypePtr & | window, | ||
double | scale_factor, | ||
double | x_shift, | ||
double | y_shift | ||
) |
Definition at line 261 of file ImageInterfaceTraits.cpp.
References ModelFitting::ImageTraits< ImageInterfaceTypePtr >::at(), ModelFitting::ImageTraits< ImageInterfaceTypePtr >::factory(), ModelFitting::ImageTraits< ImageInterfaceTypePtr >::height(), INTERP_LANCZOS4, make_kernel(), and ModelFitting::ImageTraits< ImageInterfaceTypePtr >::width().
Referenced by ModelFitting::ImageTraits< ImageInterfaceTypePtr >::addImageToImage().
|
inline |
Definition at line 46 of file TransformedAperture.cpp.
Referenced by SourceXtractor::TransformedAperture::getMaxPixel(), SourceXtractor::TransformedAperture::getMinPixel(), ModelFitting::m_rotation(), ModelFitting::TransformedModel< ImageType >::TransformedModel(), and ModelFitting::TransformModelComponent::TransformModelComponent().
|
static |
Cast a string to a C++ type depending on the format of the content.
Definition at line 50 of file FitsFile.cpp.
References std::string::at(), std::string::begin(), std::string::empty(), std::string::end(), std::string::push_back(), std::string::reserve(), std::string::size(), std::stod(), and std::stoll().
Referenced by SourceXtractor::FitsFile::loadFitsHeader(), and SourceXtractor::FitsFile::loadHeadFile().
To SourceXtractor::VariantCast | ( | const From & | from | ) |
Definition at line 37 of file VariantCast.h.
|
static |
Look for some known inconsistencies that wcslib will not report
Definition at line 105 of file WCS.cpp.
References logger, std::strlen(), std::strncmp(), and wcsExtractKeywords().
Referenced by SourceXtractor::WCS::init().
|
static |
Extract the keywords from the headers
Definition at line 93 of file WCS.cpp.
References std::set< K >::insert(), and std::strcspn().
Referenced by wcsCheckHeaders().
|
static |
|
static |
Translate the return code from wcspih to an elements exception
Definition at line 53 of file WCS.cpp.
Referenced by SourceXtractor::WCS::init().
|
static |
Translate the return code from wcss2p and wcsp2s to an elements exception
Definition at line 77 of file WCS.cpp.
References wcsLogErr().
Referenced by SourceXtractor::WCS::imageToWorld(), and SourceXtractor::WCS::worldToImage().
|
static |
Wrap wcslib error report and display them via logger
Definition at line 131 of file WCS.cpp.
References logger, and std::strchr().
Referenced by SourceXtractor::WCS::init().
|
inline |
Definition at line 69 of file PaddedImage.h.
|
static |
wcslib < 5.18 is not fully safe thread, as some functions (like discpy, called by lincpy) rely on global variables for determining the allocation sizes. For those versions, this is called instead, wrapping the call with a mutex.
Definition at line 154 of file WCS.cpp.
References std::lock().
Referenced by SourceXtractor::WCS::init().
|
static |
Definition at line 34 of file AperturePhotometryPlugin.cpp.
|
static |
Definition at line 34 of file AutoPhotometryPlugin.cpp.
|
static |
Definition at line 30 of file BackgroundConfig.cpp.
Referenced by SourceXtractor::BackgroundConfig::getProgramOptions(), and SourceXtractor::BackgroundConfig::initialize().
const SeFloat SourceXtractor::BADAREA_THRESHOLD_APER = 0.1 |
Definition at line 25 of file Flagging.cpp.
Referenced by computeFlags(), and measureFlux().
|
static |
Definition at line 25 of file Utils.h.
Referenced by SourceXtractor::SEBackgroundLevelAnalyzer::analyzeBackground(), SourceXtractor::SimpleBackgroundAnalyzer::analyzeBackground(), SourceXtractor::SE2BackgroundLevelAnalyzer::analyzeBackground(), SourceXtractor::SE2BackgroundModeller::computeScalingFactor(), SourceXtractor::SE2BackgroundModeller::createSE2Models(), SourceXtractor::SE2BackgroundLevelAnalyzer::fromSE2Modeller(), SourceXtractor::SE2BackgroundModeller::getMinIncr(), and SourceXtractor::SE2BackgroundModeller::replaceUNDEF().
|
static |
Definition at line 29 of file BlendedFlagPlugin.cpp.
|
static |
Definition at line 43 of file BoundaryFlagPlugin.cpp.
Referenced by SourceXtractor::BoundaryFlagSourceTask::computeProperties().
|
static |
Definition at line 32 of file SE2BackgroundConfig.cpp.
Referenced by SourceXtractor::SE2BackgroundConfig::getProgramOptions(), and SourceXtractor::SE2BackgroundConfig::initialize().
|
static |
Definition at line 45 of file CheckImagesConfig.cpp.
Referenced by SourceXtractor::CheckImagesConfig::getProgramOptions(), and SourceXtractor::CheckImagesConfig::initialize().
|
static |
Definition at line 44 of file CheckImagesConfig.cpp.
Referenced by SourceXtractor::CheckImagesConfig::getProgramOptions(), and SourceXtractor::CheckImagesConfig::initialize().
|
static |
Definition at line 41 of file CheckImagesConfig.cpp.
Referenced by SourceXtractor::CheckImagesConfig::getProgramOptions(), and SourceXtractor::CheckImagesConfig::initialize().
|
static |
Definition at line 40 of file CheckImagesConfig.cpp.
Referenced by SourceXtractor::CheckImagesConfig::getProgramOptions(), and SourceXtractor::CheckImagesConfig::initialize().
|
static |
Definition at line 36 of file CheckImagesConfig.cpp.
Referenced by SourceXtractor::CheckImagesConfig::getProgramOptions(), and SourceXtractor::CheckImagesConfig::initialize().
|
static |
Definition at line 34 of file CheckImagesConfig.cpp.
Referenced by SourceXtractor::CheckImagesConfig::getProgramOptions(), and SourceXtractor::CheckImagesConfig::initialize().
|
static |
Definition at line 37 of file CheckImagesConfig.cpp.
Referenced by SourceXtractor::CheckImagesConfig::getProgramOptions(), and SourceXtractor::CheckImagesConfig::initialize().
|
static |
Definition at line 48 of file CheckImagesConfig.cpp.
Referenced by SourceXtractor::CheckImagesConfig::getProgramOptions(), and SourceXtractor::CheckImagesConfig::initialize().
|
static |
Definition at line 39 of file CheckImagesConfig.cpp.
Referenced by SourceXtractor::CheckImagesConfig::getProgramOptions(), and SourceXtractor::CheckImagesConfig::initialize().
|
static |
Definition at line 46 of file CheckImagesConfig.cpp.
Referenced by SourceXtractor::CheckImagesConfig::getProgramOptions(), and SourceXtractor::CheckImagesConfig::initialize().
|
static |
Definition at line 35 of file CheckImagesConfig.cpp.
Referenced by SourceXtractor::CheckImagesConfig::getProgramOptions(), and SourceXtractor::CheckImagesConfig::initialize().
|
static |
Definition at line 38 of file CheckImagesConfig.cpp.
Referenced by SourceXtractor::CheckImagesConfig::getProgramOptions(), and SourceXtractor::CheckImagesConfig::initialize().
|
static |
Definition at line 43 of file CheckImagesConfig.cpp.
Referenced by SourceXtractor::CheckImagesConfig::getProgramOptions(), and SourceXtractor::CheckImagesConfig::initialize().
|
static |
Definition at line 42 of file CheckImagesConfig.cpp.
Referenced by SourceXtractor::CheckImagesConfig::getProgramOptions(), and SourceXtractor::CheckImagesConfig::initialize().
|
static |
Definition at line 37 of file CleaningConfig.cpp.
Referenced by SourceXtractor::CleaningConfig::getProgramOptions(), and SourceXtractor::CleaningConfig::initialize().
std::map< std::string, ValueGetter > SourceXtractor::component_value_getters |
Definition at line 45 of file PsfTask.cpp.
Referenced by SourceXtractor::PsfTask::computeProperties(), and readPsfEx().
|
static |
Definition at line 39 of file CoreThresholdPartitionConfig.cpp.
Referenced by SourceXtractor::CoreThresholdPartitionConfig::getProgramOptions(), and SourceXtractor::CoreThresholdPartitionConfig::initialize().
|
static |
Definition at line 40 of file CoreThresholdPartitionConfig.cpp.
Referenced by SourceXtractor::CoreThresholdPartitionConfig::getProgramOptions(), and SourceXtractor::CoreThresholdPartitionConfig::initialize().
|
static |
Definition at line 38 of file CoreThresholdPartitionConfig.cpp.
Referenced by SourceXtractor::CoreThresholdPartitionConfig::getProgramOptions(), and SourceXtractor::CoreThresholdPartitionConfig::initialize().
const SeFloat SourceXtractor::CROWD_THRESHOLD_APER = 0.1 |
Definition at line 24 of file Flagging.cpp.
Referenced by computeFlags().
|
static |
Definition at line 32 of file MinAreaPartitionConfig.cpp.
Referenced by SourceXtractor::MinAreaPartitionConfig::getProgramOptions(), and SourceXtractor::MinAreaPartitionConfig::initialize().
|
static |
Definition at line 27 of file DetectionFrameCoordinatesPlugin.cpp.
|
static |
Definition at line 27 of file DetectionFrameImagesPlugin.cpp.
|
static |
Definition at line 33 of file DetectionFrameGroupStampPlugin.cpp.
|
static |
Definition at line 27 of file DetectionFrameInfoPlugin.cpp.
|
static |
Definition at line 33 of file DetectionFramePixelValuesPlugin.cpp.
|
static |
Definition at line 33 of file DetectionFrameSourceStampPlugin.cpp.
|
static |
Definition at line 37 of file DetectionImageConfig.cpp.
Referenced by SourceXtractor::DetectionImageConfig::getProgramOptions(), and SourceXtractor::DetectionImageConfig::initialize().
|
static |
Definition at line 39 of file DetectionImageConfig.cpp.
Referenced by SourceXtractor::DetectionImageConfig::getProgramOptions(), and SourceXtractor::DetectionImageConfig::initialize().
|
static |
Definition at line 38 of file DetectionImageConfig.cpp.
Referenced by SourceXtractor::DetectionImageConfig::getProgramOptions(), and SourceXtractor::DetectionImageConfig::initialize().
|
static |
Definition at line 41 of file DetectionImageConfig.cpp.
Referenced by SourceXtractor::DetectionImageConfig::getProgramOptions(), and SourceXtractor::DetectionImageConfig::initialize().
|
static |
Definition at line 42 of file DetectionImageConfig.cpp.
Referenced by SourceXtractor::DetectionImageConfig::getProgramOptions(), and SourceXtractor::DetectionImageConfig::initialize().
|
static |
Definition at line 40 of file DetectionImageConfig.cpp.
Referenced by SourceXtractor::DetectionImageConfig::getProgramOptions(), and SourceXtractor::DetectionImageConfig::initialize().
boost::mutex SourceXtractor::fftw_global_plan_mutex {} |
FFTW3 requires a global mutex when creating a plan. Plan executions are, on the other hand, thread safe.
Definition at line 34 of file FFT.cpp.
Referenced by SourceXtractor::FFT< T >::createForwardPlan(), and SourceXtractor::FFT< T >::createInversePlan().
|
static |
Definition at line 36 of file FitsWriter.h.
Referenced by SourceXtractor::FitsWriter::newImage(), and SourceXtractor::FitsWriter::newTemporaryImage().
|
static |
Definition at line 35 of file FlexibleModelFittingPlugin.cpp.
|
static |
Definition at line 26 of file FluxRadiusConfig.cpp.
Referenced by SourceXtractor::FluxRadiusConfig::getProgramOptions(), and SourceXtractor::FluxRadiusConfig::initialize().
|
static |
Definition at line 27 of file FluxRadiusPlugin.cpp.
|
static |
Definition at line 44 of file OutputConfig.cpp.
Referenced by SourceXtractor::OutputConfig::initialize(), and SourceXtractor::OutputConfig::preInitialize().
|
static |
Definition at line 34 of file GroupInfoPlugin.cpp.
|
static |
Definition at line 36 of file GroupingConfig.cpp.
Referenced by SourceXtractor::GroupingConfig::getProgramOptions(), and SourceXtractor::GroupingConfig::initialize().
|
static |
Definition at line 43 of file GroupingConfig.cpp.
Referenced by SourceXtractor::GroupingConfig::initialize().
|
static |
Definition at line 40 of file GroupingConfig.cpp.
Referenced by SourceXtractor::GroupingConfig::getProgramOptions(), and SourceXtractor::GroupingConfig::initialize().
|
static |
Definition at line 41 of file GroupingConfig.cpp.
Referenced by SourceXtractor::GroupingConfig::initialize().
|
static |
Definition at line 42 of file GroupingConfig.cpp.
Referenced by SourceXtractor::GroupingConfig::initialize().
|
static |
Definition at line 38 of file GroupingConfig.cpp.
Referenced by SourceXtractor::GroupingConfig::getProgramOptions(), and SourceXtractor::GroupingConfig::initialize().
|
static |
Definition at line 37 of file GroupingConfig.cpp.
Referenced by SourceXtractor::GroupingConfig::getProgramOptions(), and SourceXtractor::GroupingConfig::initialize().
|
static |
Definition at line 26 of file GrowthCurveConfig.cpp.
Referenced by SourceXtractor::GrowthCurveTask::computeProperties(), SourceXtractor::GrowthCurveConfig::getProgramOptions(), and SourceXtractor::GrowthCurveConfig::initialize().
|
static |
Definition at line 35 of file GrowthCurveTask.cpp.
|
static |
Definition at line 34 of file GrowthCurveTask.cpp.
Referenced by SourceXtractor::GrowthCurveTask::computeProperties().
|
static |
Definition at line 30 of file GrowthCurvePlugin.cpp.
|
static |
Definition at line 33 of file IsophotalFluxPlugin.cpp.
|
static |
Definition at line 31 of file JacobianPlugin.cpp.
|
static |
Definition at line 32 of file KronRadiusPlugin.cpp.
|
static |
Definition at line 34 of file SE2BackgroundConfig.cpp.
Referenced by SourceXtractor::SE2BackgroundConfig::getProgramOptions(), and SourceXtractor::SE2BackgroundConfig::initialize().
|
static |
Definition at line 34 of file FlexibleModelFittingTaskFactory.cpp.
|
static |
Definition at line 45 of file PluginManager.cpp.
|
static |
Definition at line 46 of file WCS.cpp.
Referenced by BenchBackgroundConvolution::benchmark(), BenchConvolution::benchmark(), SourceXtractor::FlexibleModelFittingTask::computeProperties(), SourceXtractor::FlexibleModelFittingTaskFactory::configure(), SourceXtractor::ProgressReporterFactory::createProgressMediator(), SourceXtractor::PsfPluginConfig::generateGaussianPsf(), SourceXtractor::WCS::init(), SourceXtractor::ModelFittingConfig::initialize(), SourceXtractor::ModelFittingConfig::initializeInner(), SourceXtractor::PluginManager::loadPlugins(), main(), BenchBackgroundConvolution::mainMethod(), BenchConvolution::mainMethod(), SEMain::mainMethod(), TestImage::mainMethod(), SourceXtractor::MultithreadedMeasurement::outputThreadStatic(), SourceXtractor::BackgroundConvolution::processImage(), readImage(), readPsfEx(), BenchBackgroundConvolution::verifyResults(), BenchConvolution::verifyResults(), SourceXtractor::MultithreadedMeasurement::waitForThreads(), wcsCheckHeaders(), wcsLogErr(), and wcsReportWarnings().
|
static |
Definition at line 64 of file FlexibleModelFittingTask.cpp.
|
static |
Definition at line 31 of file MagnitudeConfig.cpp.
Referenced by SourceXtractor::MagnitudeConfig::getProgramOptions(), and SourceXtractor::MagnitudeConfig::initialize().
|
static |
Definition at line 31 of file MemoryConfig.cpp.
Referenced by SourceXtractor::MemoryConfig::getProgramOptions(), and SourceXtractor::MemoryConfig::initialize().
|
static |
Definition at line 27 of file MeasurementFrameCoordinatesPlugin.cpp.
|
static |
Definition at line 27 of file MeasurementFrameImagesPlugin.cpp.
|
static |
Definition at line 33 of file MeasurementFrameGroupRectanglePlugin.cpp.
|
static |
Definition at line 27 of file MeasurementFrameInfoPlugin.cpp.
|
static |
Definition at line 33 of file MeasurementFramePixelCentroidPlugin.cpp.
|
static |
Definition at line 34 of file MeasurementFramePlugin.cpp.
|
static |
Definition at line 33 of file MeasurementFrameRectanglePlugin.cpp.
|
static |
Definition at line 33 of file LegacyModelFittingConfig.cpp.
Referenced by SourceXtractor::LegacyModelFittingConfig::getProgramOptions(), and SourceXtractor::LegacyModelFittingConfig::initialize().
|
static |
Definition at line 32 of file LegacyModelFittingConfig.cpp.
Referenced by SourceXtractor::LegacyModelFittingConfig::getProgramOptions(), and SourceXtractor::LegacyModelFittingConfig::initialize().
Elements::Logging SourceXtractor::model_fitting_logger = Elements::Logging::getLogger("ModelFitting") |
Definition at line 33 of file FlexibleModelFittingPlugin.cpp.
|
static |
|
static |
|
static |
Definition at line 37 of file MultiThresholdPartitionConfig.cpp.
Referenced by SourceXtractor::MultiThresholdPartitionConfig::getProgramOptions(), and SourceXtractor::MultiThresholdPartitionConfig::initialize().
|
static |
Definition at line 38 of file MultiThresholdPartitionConfig.cpp.
Referenced by SourceXtractor::MultiThresholdPartitionConfig::getProgramOptions(), and SourceXtractor::MultiThresholdPartitionConfig::initialize().
|
static |
Definition at line 36 of file MultiThresholdPartitionConfig.cpp.
Referenced by SourceXtractor::MultiThresholdPartitionConfig::getProgramOptions(), and SourceXtractor::MultiThresholdPartitionConfig::initialize().
|
static |
Definition at line 35 of file MultiThresholdPartitionConfig.cpp.
Referenced by SourceXtractor::MultiThresholdPartitionConfig::getProgramOptions(), and SourceXtractor::MultiThresholdPartitionConfig::initialize().
|
static |
Definition at line 28 of file CoreThresholdPartitionPlugin.cpp.
|
static |
Definition at line 43 of file NDetectedPixelsPlugin.cpp.
|
static |
Elements::Logging SourceXtractor::onnx_logger = Elements::Logging::getLogger("Onnx") |
Logger for the ONNX plugin.
Definition at line 26 of file OnnxPlugin.cpp.
Referenced by SourceXtractor::OnnxTaskFactory::configure().
|
static |
Definition at line 26 of file OnnxConfig.cpp.
Referenced by SourceXtractor::OnnxConfig::getProgramOptions(), and SourceXtractor::OnnxConfig::initialize().
|
static |
Definition at line 25 of file OnnxPlugin.cpp.
|
static |
Definition at line 30 of file OnnxTaskFactory.cpp.
Referenced by SourceXtractor::OnnxTaskFactory::configure().
|
static |
Definition at line 39 of file OutputConfig.cpp.
Referenced by SourceXtractor::OutputConfig::getProgramOptions(), and SourceXtractor::OutputConfig::initialize().
|
static |
Definition at line 40 of file OutputConfig.cpp.
Referenced by SourceXtractor::OutputConfig::getProgramOptions(), SourceXtractor::OutputConfig::initialize(), and SourceXtractor::OutputConfig::preInitialize().
|
static |
Definition at line 42 of file OutputConfig.cpp.
Referenced by SourceXtractor::OutputConfig::getProgramOptions(), and SourceXtractor::OutputConfig::initialize().
|
static |
Definition at line 41 of file OutputConfig.cpp.
Referenced by SourceXtractor::OutputConfig::getProgramOptions(), and SourceXtractor::OutputConfig::initialize().
|
static |
Definition at line 33 of file PeakValuePlugin.cpp.
constexpr float SourceXtractor::PI = boost::math::constants::pi<float>() |
Definition at line 15 of file ImageInterfaceTraits.cpp.
Referenced by makeLanczos2Kernel(), makeLanczos3Kernel(), and makeLanczos4Kernel().
|
static |
Definition at line 33 of file ExternalFlagPlugin.cpp.
|
static |
Definition at line 34 of file PixelBoundariesPlugin.cpp.
|
static |
Definition at line 33 of file PixelCentroidPlugin.cpp.
|
static |
Definition at line 34 of file WorldCentroidPlugin.cpp.
|
static |
Definition at line 32 of file PluginConfig.cpp.
Referenced by SourceXtractor::PluginConfig::getProgramOptions(), and SourceXtractor::PluginConfig::initialize().
|
static |
Definition at line 31 of file PluginConfig.cpp.
Referenced by SourceXtractor::PluginConfig::getProgramOptions(), and SourceXtractor::PluginConfig::initialize().
|
static |
Definition at line 41 of file ProgressNCurses.cpp.
Referenced by handleStopSignal(), handleTerminatingSignal(), SourceXtractor::Screen::Screen(), and SourceXtractor::Screen::~Screen().
|
static |
Definition at line 26 of file ProgressReporterFactory.cpp.
Referenced by SourceXtractor::ProgressReporterFactory::addOptions(), and SourceXtractor::ProgressReporterFactory::configure().
|
static |
Definition at line 25 of file ProgressReporterFactory.cpp.
Referenced by SourceXtractor::ProgressReporterFactory::addOptions(), and SourceXtractor::ProgressReporterFactory::configure().
|
static |
Definition at line 38 of file PsfPluginConfig.cpp.
Referenced by SourceXtractor::PsfPluginConfig::getProgramOptions(), SourceXtractor::PsfPluginConfig::initialize(), and SourceXtractor::PsfPluginConfig::preInitialize().
|
static |
Definition at line 39 of file PsfPluginConfig.cpp.
Referenced by SourceXtractor::PsfPluginConfig::getProgramOptions(), SourceXtractor::PsfPluginConfig::initialize(), and SourceXtractor::PsfPluginConfig::preInitialize().
|
static |
Definition at line 40 of file PsfPluginConfig.cpp.
Referenced by SourceXtractor::PsfPluginConfig::getProgramOptions(), SourceXtractor::PsfPluginConfig::initialize(), and SourceXtractor::PsfPluginConfig::preInitialize().
|
static |
Definition at line 37 of file PsfPlugin.cpp.
decltype(&lincpy) SourceXtractor::safe_lincpy = &lincpy |
Definition at line 48 of file WCS.cpp.
Referenced by SourceXtractor::WCS::imageToWorld(), SourceXtractor::WCS::init(), and SourceXtractor::WCS::worldToImage().
|
static |
Definition at line 27 of file SamplingConfig.cpp.
|
static |
Definition at line 28 of file SamplingConfig.cpp.
Referenced by SourceXtractor::SamplingConfig::getProgramOptions(), and SourceXtractor::SamplingConfig::initialize().
|
static |
Definition at line 43 of file SaturateFlagPlugin.cpp.
Referenced by SourceXtractor::SaturateFlagSourceTask::computeProperties().
|
static |
Definition at line 48 of file SegmentationConfig.cpp.
Referenced by SourceXtractor::SegmentationConfig::getDefaultFilter(), SourceXtractor::SegmentationConfig::loadASCIIFilter(), and SourceXtractor::SegmentationConfig::loadFITSFilter().
|
static |
Definition at line 50 of file SegmentationConfig.cpp.
Referenced by SourceXtractor::SegmentationConfig::getProgramOptions(), and SourceXtractor::SegmentationConfig::preInitialize().
|
static |
Definition at line 54 of file SegmentationConfig.cpp.
Referenced by SourceXtractor::SegmentationConfig::getProgramOptions(), and SourceXtractor::SegmentationConfig::preInitialize().
|
static |
Definition at line 51 of file SegmentationConfig.cpp.
Referenced by SourceXtractor::SegmentationConfig::getProgramOptions(), and SourceXtractor::SegmentationConfig::preInitialize().
|
static |
Definition at line 52 of file SegmentationConfig.cpp.
Referenced by SourceXtractor::SegmentationConfig::getProgramOptions(), and SourceXtractor::SegmentationConfig::preInitialize().
|
static |
Definition at line 53 of file SegmentationConfig.cpp.
Referenced by SourceXtractor::SegmentationConfig::getProgramOptions(), and SourceXtractor::SegmentationConfig::preInitialize().
|
static |
Definition at line 33 of file ShapeParametersPlugin.cpp.
|
static |
Definition at line 44 of file ProgressNCurses.cpp.
Referenced by handleResizeSignal(), SourceXtractor::ProgressNCurses::Dashboard::handleSignal(), handleTerminatingSignal(), SourceXtractor::ProgressNCurses::Dashboard::ncursesMode(), SourceXtractor::Screen::Screen(), and SourceXtractor::Screen::~Screen().
|
static |
Definition at line 40 of file ProgressNCurses.cpp.
Referenced by SourceXtractor::Screen::Screen().
|
static |
Definition at line 33 of file MoffatModelFittingPlugin.cpp.
|
static |
Definition at line 33 of file SE2BackgroundConfig.cpp.
Referenced by SourceXtractor::SE2BackgroundConfig::getProgramOptions(), and SourceXtractor::SE2BackgroundConfig::initialize().
|
static |
Definition at line 29 of file SNRRatioPlugin.cpp.
|
static |
Definition at line 43 of file SourceFlagsPlugin.cpp.
Referenced by SourceXtractor::FlexibleModelFittingTask::computeProperties(), and SourceXtractor::SourceFlagsSourceTask::computeProperties().
|
static |
Definition at line 46 of file SourceIDsPlugin.cpp.
const int SourceXtractor::SUPERSAMPLE_NB = 10 |
Definition at line 29 of file CIrcularAperture.cpp.
Referenced by SourceXtractor::CircularAperture::getArea().
|
static |
Definition at line 33 of file MultiThreadingConfig.cpp.
Referenced by SourceXtractor::MultiThreadingConfig::getProgramOptions(), and SourceXtractor::MultiThreadingConfig::initialize().
|
static |
Definition at line 31 of file BackgroundConfig.cpp.
Referenced by SourceXtractor::BackgroundConfig::getProgramOptions(), and SourceXtractor::BackgroundConfig::initialize().
|
static |
Definition at line 32 of file MemoryConfig.cpp.
Referenced by SourceXtractor::MemoryConfig::getProgramOptions(), and SourceXtractor::MemoryConfig::initialize().
|
static |
Definition at line 33 of file AttractorsPartitionConfig.cpp.
Referenced by SourceXtractor::AttractorsPartitionConfig::getProgramOptions(), and SourceXtractor::AttractorsPartitionConfig::initialize().
|
static |
Definition at line 36 of file CleaningConfig.cpp.
Referenced by SourceXtractor::CleaningConfig::getProgramOptions(), and SourceXtractor::CleaningConfig::initialize().
|
static |
Definition at line 29 of file VignetPlugin.cpp.
|
static |
Definition at line 32 of file VignetConfig.cpp.
Referenced by SourceXtractor::VignetConfig::getProgramOptions(), and SourceXtractor::VignetConfig::initialize().
|
static |
Definition at line 31 of file VignetConfig.cpp.
Referenced by SourceXtractor::VignetConfig::getProgramOptions(), and SourceXtractor::VignetConfig::initialize().
|
static |
Definition at line 45 of file WeightImageConfig.cpp.
Referenced by SourceXtractor::WeightImageConfig::getProgramOptions(), and SourceXtractor::WeightImageConfig::initialize().
|
static |
Definition at line 43 of file WeightImageConfig.cpp.
Referenced by SourceXtractor::WeightImageConfig::getProgramOptions(), and SourceXtractor::WeightImageConfig::initialize().
|
static |
Definition at line 46 of file WeightImageConfig.cpp.
Referenced by SourceXtractor::WeightImageConfig::getProgramOptions(), and SourceXtractor::WeightImageConfig::initialize().
|
static |
Definition at line 48 of file WeightImageConfig.cpp.
Referenced by SourceXtractor::WeightImageConfig::getProgramOptions(), and SourceXtractor::WeightImageConfig::initialize().
|
static |
Definition at line 47 of file WeightImageConfig.cpp.
Referenced by SourceXtractor::WeightImageConfig::getProgramOptions(), and SourceXtractor::WeightImageConfig::initialize().
|
static |
Definition at line 44 of file WeightImageConfig.cpp.
Referenced by SourceXtractor::WeightImageConfig::getProgramOptions(), and SourceXtractor::WeightImageConfig::initialize().